Package Summary
Documented
The meta package for Clober
- Maintainer status: developed
- Maintainer: clobot-git <ros AT clobot.co DOT kr>
- Author:
- License: Apache License 2.0
- Source: git https://github.com/CLOBOT-Co-Ltd/clober.git (branch: noetic-devel)
Contents
ROS Software Maintainer: Clobot
Overview
Myahrs ROS2 Driver package is a ROS2 driver for the myAHRS+ which is a low cost high performance AHRS(Attitude Heading Reference System). Using this package, users can create the format of IMU sensor_msgs in ROS2 system.
ROS Wiki related to related to Myahrs ROS2 Driver
References related to Myahrs ROS2 Driver
Video
ROS API
myahrs_ros2_driver
'myahrs_ros2_driver' is a ROS2 driver for the myAHRS+ which is a low cost high performance AHRS(Attitude Heading Reference System).Published Topics
imu/data_raw (sensor_msgs/Imu)- raw data of linear_acceleration and angular_velocity from myahrs+.
- orientation data from myahrs+, including raw data of linear_acceleration and angular_velocity.
- magnetic_field data from myahrs+.
- temperature data from myahrs+.
Parameters
~angular_velocity_stddev (double, default: 0.002428)- square root of the angular_velocity_covariance diagonal elements in rad/s.
- square root of the linear_acceleration_covariance diagonal elements in m/s^2.
- square root of the magnetic_field_covariance diagonal elements in Tesla.
- square root of the orientation_covariance diagonal elements in rad.