Skip to content

IMU orientation not reflected in TF tree #139

@TannerGilbert

Description

@TannerGilbert

Bug report

Issue details

For the Iris with Standoff model the IMU is rotated 180° around the X axis (https://github.com/ArduPilot/ardupilot_gazebo/blob/main/models/iris_with_standoffs/model.sdf#L157) but this is not reflected in the TF tree between base_link and imu_link leading to confusion when relying on the TF tree for extrinsics.

E.g.: ros2 run tf2_ros tf2_echo base_link imu_link

Output:

At time 6.800000000
- Translation: [0.000, 0.000, 0.000]
- Rotation: in Quaternion [0.000, 0.000, 0.000, 1.000]
- Rotation: in RPY (radian) [0.000, -0.000, 0.000]
- Rotation: in RPY (degree) [0.000, -0.000, 0.000]
- Matrix:
  1.000 -0.000  0.000  0.000
  0.000  1.000  0.000  0.000
  0.000  0.000  1.000  0.000
  0.000  0.000  0.000  1.000

Version
Tested on Ubuntu 22.04, ROS 2 Humble and Gazebo Harmonic following https://ardupilot.org/dev/docs/ros2-gazebo.html

Platform
[ ] All
[ ] AntennaTracker
[ x ] Copter
[ ] Plane
[ ] Rover
[ ] Submarine

Airframe type
Iris

Hardware type

  • (Simulation)

Metadata

Metadata

Assignees

No one assigned

    Labels

    No labels
    No labels

    Type

    No type

    Projects

    No projects

    Milestone

    No milestone

    Relationships

    None yet

    Development

    No branches or pull requests

    Issue actions