ROS Resources: Documentation | Support | Discussion Forum | Index | Service Status | ros @ Robotics Stack Exchange
Ask Your Question
0

height position control in gazebo

asked 2012-01-09 22:37:48 -0500

hmmm gravatar image

hi guys, i need a height position control for a quadrocopter in gazebo. Is there any useable plugin to achieve this goal? I thought of an ultrasonic sensor plugin for gazebo that provides the height information. Any suggestions are welcome

thanks,greetz

edit retag flag offensive close merge delete

1 Answer

Sort by ยป oldest newest most voted
1

answered 2012-01-10 00:21:18 -0500

DimitriProsser gravatar image

Gazebo has a position_3d plugin that will give you the robot's height. You can use this plugin like so:

<gazebo>
  <controller:gazebo_ros_p3d name="p3d_base_controller" plugin="libgazebo_ros_p3d.so">
    <alwaysOn>true</alwaysOn>
    <updateRate>100.0</updateRate>
    <bodyName>base_link</bodyName>
    <topicName>base_pose_ground_truth</topicName>
    <gaussianNoise>0</gaussianNoise>
    <frameName>map</frameName>
    <xyzOffsets>0 0 0</xyzOffsets> 
    <rpyOffsets>0 0 0</rpyOffsets>
    <interface:position name="p3d_base_position"/>
  </controller:gazebo_ros_p3d>
</gazebo>

This plugin will publish a sensor_msgs/Odometry message that you can extract height from.

edit flag offensive delete link more

Question Tools

Stats

Asked: 2012-01-09 22:37:48 -0500

Seen: 846 times

Last updated: Jan 10 '12