rxplot euler from gazebo
hi guys, i want to plot the orientation of my quadrotor in euler and not in quaterion. is there a opportunity (message) how i can get the angels in euler from gazebo?
thankgs,regards
ROS Resources: Documentation | Support | Discussion Forum | Index | Service Status | ros @ Robotics Stack Exchange |
hi guys, i want to plot the orientation of my quadrotor in euler and not in quaterion. is there a opportunity (message) how i can get the angels in euler from gazebo?
thankgs,regards
I had a similar need so I wrote a simple Python node that does this for the quaternion in nav_msgs/Odometry messages. It allows you to select the Euler rotation convention and will also optionally output the Euler angles in degrees. If you want to take a look it's called quat_to_ypr.py in the starmac_tools package (starmac_common stack).
Rotations in ROS are always communicated as Quaternions. You will need to convert them by hand. TF uses Bullet internally which has utility methods to convert to and from Euler angles. See here.
Asked: 2012-03-23 02:07:16 -0500
Seen: 453 times
Last updated: Mar 23 '12
Setting inertia for a whole robot
Gazebo Planar Move Plugin for Omni-Directional Wheel
Turtlebot3 and diff_drive_controller
How to replace Gazebo physics with Mujoco
Service call failed while launching the gazebo
Gazebo simulation time speed up.
How to save Gazebo Maps? [closed]
Spawn a blender file in Gazebo
How to solve problem with PATH_TOLERANCE_VIOLATED in moveit?