Show EOL distros:
Package Summary
Node/nodelet combination to transform sensor_msgs::Imu data from one frame into another.
- Maintainer status: maintained
- Maintainer: Paul Bovbel <pbovbel AT clearpathrobotics DOT com>, Tony Baltovski <tbaltovski AT clearpathrobotics DOT com>
- Author: Paul Bovbel <pbovbel AT clearpathrobotics DOT com>
- License: GPL
- Bug / feature tracker: https://github.com/ros-perception/imu_transformer/issues
- Source: git https://github.com/ros-perception/imu_pipeline.git (branch: indigo-devel)
Package Summary
Node/nodelet combination to transform sensor_msgs::Imu data from one frame into another.
- Maintainer status: maintained
- Maintainer: Paul Bovbel <pbovbel AT clearpathrobotics DOT com>, Tony Baltovski <tbaltovski AT clearpathrobotics DOT com>
- Author: Paul Bovbel <pbovbel AT clearpathrobotics DOT com>
- License: GPL
- Bug / feature tracker: https://github.com/ros-perception/imu_transformer/issues
- Source: git https://github.com/ros-perception/imu_pipeline.git (branch: indigo-devel)
Package Summary
Node/nodelet combination to transform sensor_msgs::Imu data from one frame into another.
- Maintainer status: maintained
- Maintainer: Paul Bovbel <pbovbel AT clearpathrobotics DOT com>, Tony Baltovski <tbaltovski AT clearpathrobotics DOT com>
- Author: Paul Bovbel <pbovbel AT clearpathrobotics DOT com>
- License: GPL
- Bug / feature tracker: https://github.com/ros-perception/imu_transformer/issues
- Source: git https://github.com/ros-perception/imu_pipeline.git (branch: indigo-devel)
Package Summary
Node/nodelet combination to transform sensor_msgs::Imu data from one frame into another.
- Maintainer status: maintained
- Maintainer: Paul Bovbel <pbovbel AT clearpathrobotics DOT com>, Tony Baltovski <tbaltovski AT clearpathrobotics DOT com>
- Author: Paul Bovbel <pbovbel AT clearpathrobotics DOT com>
- License: GPL
- Bug / feature tracker: https://github.com/ros-perception/imu_transformer/issues
- Source: git https://github.com/ros-perception/imu_pipeline.git (branch: indigo-devel)
Package Summary
Node/nodelet combination to transform sensor_msgs::Imu data from one frame into another.
- Maintainer status: maintained
- Maintainer: Paul Bovbel <pbovbel AT clearpathrobotics DOT com>, Tony Baltovski <tbaltovski AT clearpathrobotics DOT com>
- Author: Paul Bovbel <pbovbel AT clearpathrobotics DOT com>
- License: GPL
- Bug / feature tracker: https://github.com/ros-perception/imu_transformer/issues
- Source: git https://github.com/ros-perception/imu_pipeline.git (branch: indigo-devel)
Package Summary
Node/nodelet combination to transform sensor_msgs::Imu data from one frame into another.
- Maintainer status: maintained
- Maintainer: Paul Bovbel <pbovbel AT clearpathrobotics DOT com>, Tony Baltovski <tbaltovski AT clearpathrobotics DOT com>
- Author: Paul Bovbel <pbovbel AT clearpathrobotics DOT com>
- License: GPL
- Bug / feature tracker: https://github.com/ros-perception/imu_transformer/issues
- Source: git https://github.com/ros-perception/imu_pipeline.git (branch: noetic-devel)
Please check the FAQ for common problems, or open an issue if still unsolved.
This package provides a node/nodelet combination that can be used to transform IMU data from one TF frame into another. It is a thin wrapper around a tf2 transform implemented in tf2_sensor_msgs (awaiting https://github.com/ros/geometry_experimental/pull/78).
Node
imu_transformer_node
imu_transformer_node takes in IMU data (Accelerometer, Magnetometer, Gyroscope, and fused orientation), and transforms it from one frame into another.Subscribed Topics
imu_in/data (sensor_msgs/Imu)- Input IMU data
- Input magnetometer data. For backwards compatibility, also supports geometry_msgs/Vector3
Published Topics
imu_out/data (sensor_msgs/Imu)- Output IMU data
- Output magnetometer data.
Parameters
~target_frame (string, default: base_link)- Target frame to transform incoming IMU data into.
Nodelet
Same API as node, available as imu_transformer/imu_transformer_nodelet.