Wiki

Only released in EOL distros:  

Package Summary

myahrs_driver is a driver package for the WITHROBOT's myAHRS+. The myAHRS+ is a low cost high performance AHRS(Attitude Heading Reference System) with USB/UART/I2C interface. The myAHRS+ board contains a 3-axis 16-bit gyroscope, a 3-axis 16-bit accelerometer and a 3-axis 13-bit magnetometer. The driver should also work with USB port.

Package Summary

myahrs_driver is a driver package for the WITHROBOT's myAHRS+. The myAHRS+ is a low cost high performance AHRS(Attitude Heading Reference System) with USB/UART/I2C interface. The myAHRS+ board contains a 3-axis 16-bit gyroscope, a 3-axis 16-bit accelerometer and a 3-axis 13-bit magnetometer. The driver should also work with USB port.

Overview

This is a driver package for the WITHROBOT's myAHRS+ from lilliputdirect and hardkernel . The myAHRS+ is a low cost high performance AHRS(Attitude Heading Reference System) with USB/UART/I2C interface. The myAHRS+ board contains a 3-axis 16-bit gyroscope, a 3-axis 16-bit accelerometer and a 3-axis 13-bit magnetometer. The driver should also work with USB port.

Axes Convention

myahrs_plus_axes.png

The myAHRS+ board used NED type. The myahrs_driver contained in this package converts to the frame conventions of ROS (use the east north up (ENU) convention and right hand rule) before publishing the msgs. The driver use the coordinate frame below. Please see REP-0103 for more information.

Original Source

The original source (not support ROS) is maintained github below and tutorials are on the corresponding wiki page. A 3D visualization test like 3D-box is included in this original source. This package used the myAHRS+ SDK below.

https://github.com/withrobot/myAHRS_plus

Video

This is a visualization demonstration using RViz.

Installation

Install the package:

sudo apt-get install ros-indigo-myahrs-driver

Install the package from the github:

cd ~/catkin_ws/src
git clone https://github.com/robotpilot/myahrs_driver.git
cd ~/catkin_ws && catkin_make

Run

Run the driver like so:

rosrun myahrs_driver myahrs_driver _port:=/dev/ttyACM0

or

roslaunch myahrs_driver myahrs_driver.launch

Nodes

myahrs_driver

myahrs_driver node is a driver for the myAHRS+ Inertial Measurement Unit(IMU). It publishes orientation, angular velocity and linear acceleration as well as their covariances, and complies with the REP103 and REP145 (draft) about conventions for IMU sensor drivers.

Published Topics

imu/data_raw (sensor_msgs/Imu) imu/data (sensor_msgs/Imu) imu/mag (sensor_msgs/MagneticField) imu/temperature (std_msgs/Float64)

Parameters

~port (string, default: /dev/ttyACM0) ~baud_rate (int, default: 115200) ~frame_id (string, default: imu_link) ~parent_frame_id_ (string, default: base_link) ~linear_acceleration_stddev (double, default: 0.026831) ~angular_velocity_stddev (double, default: 0.002428) ~magnetic_field_stddev (double, default: 0.00000327486) ~orientation_stddev (double, default: 0.002143)

Communication Protocol Manual and Forum

The myAHRS+ protocol can be found here. The Forum for myAHRS+ user can be found here.

Report a bug

https://github.com/robotpilot/myahrs_driver/issues

Wiki: myahrs_driver (last edited 2015-03-11 08:01:16 by GvdHoorn)