2017-03-29 09:46:40 -0500 | received badge | ● Famous Question (source) |
2017-03-29 09:46:40 -0500 | received badge | ● Notable Question (source) |
2017-02-24 05:08:26 -0500 | received badge | ● Popular Question (source) |
2017-02-21 12:51:14 -0500 | asked a question | Set Odometry in a new robot in ROS I'm trying to create a robot with a new model in ROS .gazebo/models. I defined model.config and model.sdf. I have to set the ros message Odometry because in the 'risotopic list' there isn't /odom. How can I define the odometry of my robot? this is model.sdf: <sdf version="1.4"> <model name="arduino_robot"> <static>true</static> <sensor name="laser" type="ray"> <pose>-0.065000 0 0.092000 0 0 0</pose> <ray> <scan> <horizontal> <samples>180</samples> <resolution>1.000000</resolution> <min_angle>-2.268928</min_angle> <max_angle>2.268928</max_angle> </horizontal> </scan> <range> <min>0.080000</min> <max>10</max> <resolution>0.010000</resolution> </range> </ray> <update_rate>20</update_rate> </sensor> </link> <include> <uri>model://kinect</uri> <pose>-0.087098 0 0.303857 0 0 0</pose> </include> <joint name="create_rack" type="revolute"> <parent>create::base</parent> <child>rack</child> <axis> <xyz>0 0 1</xyz> <limit> <lower>0</lower> <upper>0</upper> </limit> </axis> </joint> <joint name="kinect_rack" type="revolute"> <parent>kinect::link</parent> <child>rack</child> <axis> <xyz>0 0 1</xyz> <limit> <lower>0</lower> <upper>0</upper> </limit> </axis> </joint> <plugin name="Odometry" filename="libodometry.so"/> |