You signed in with another tab or window. Reload to refresh your session.You signed out in another tab or window. Reload to refresh your session.You switched accounts on another tab or window. Reload to refresh your session.Dismiss alert
#47 introduced a bug in how the Euler angles are reported.
As initial context: static_transform_publisher expects the angles to be specified in yaw pitch roll order (or ZYX), while URDF uses rpy order (or XYZ).
But the output as reported by #47 does not correspond to rpy.
As a counterexample, using the same numbers as used in this comment from the PR:
<launch>
<!-- The rpy in the comment uses the extrinsic XYZ convention, which is the same as is used in a URDF. See http://wiki.ros.org/geometry2/RotationMethods and https://en.wikipedia.org/wiki/Euler_angles for more info. --><!-- xyz="-0.0852237 -0.0776651 0.0608126" rpy="2.97005 -2.35605 3.01759" -->
<nodepkg="tf2_ros"type="static_transform_publisher"name="camera_link_broadcaster"args="-0.0852237 -0.0776651 0.0608126 -0.0553599 -0.385516 -0.0243088 0.920718 ur3_wrist_3_link camera_color_optical_frame" />
</launch>
#47 introduced a bug in how the Euler angles are reported.
As initial context: static_transform_publisher expects the angles to be specified in
yaw pitch roll
order (or ZYX), while URDF usesrpy
order (or XYZ).But the output as reported by #47 does not correspond to rpy.
As a counterexample, using the same numbers as used in this comment from the PR:
You can see that the orientation reported corresponds to
axes='rxyz'
.So to properly report
rpy
the code should be something like:I can prepare a proper PR for that if needed.
The text was updated successfully, but these errors were encountered: