Only released in EOL distros:  

Package Summary

Driver for Orientus IMU

Package Summary

Driver for Orientus IMU

Overview

A ROS driver for the Advanced Navigation Orientus IMU.

Nodes

orientus_node

Node to communicate with an Orientus IMU.

Published Topics

imu/data (sensor_msgs/Imu)
  • The filtered orientation and sensor data output of the IMU.
imu/raw (sensor_msgs/Imu)
  • The raw accelerator and sensor data from the IMU. The orientation field is not filled in.
imu/mag (sensor_msgs/MagneticField)
  • The raw magnetics sensor output.
imu/temp (sensor_msgs/Temperature)
  • The raw imu temperature.
/diagnostics (diagnostic_msgs/DiagnosticArray)
  • Diagnostic information about the sensor.

Parameters

~port (string, default: /dev/ttyUSB0)
  • The serial port to use to communicate with the device.
~frame_id (string, default: imu)
  • The name of the tf frame that messages are published with.

Wiki: orientus_driver (last edited 2014-11-03 19:44:27 by MitchellWills)