gazebo - issues with caster wheels and inertial values [closed]

asked 2017-02-20 02:50:46 -0500

Auton0mous gravatar image

Just imported a simple differential drive with 2 motor controlled big wheels at the front and 2 small caster wheels in the rear.

Have found 2 issues which have me stumped.

1.) After increasing the weight of the motor, the robot slowly slides across the floor when still.

2.) The rear caster wheels always turn perpendicular to the direction of movement. When the robot stops moving the rear wheels turn to align with the front wheels.

below is the code for one of the caster wheels

  <link name="rrw">
<visual>
  <geometry>
    <cylinder length="0.03175" radius="0.0635"/>
  </geometry>
  <material name="black">
    <color rgba="0 0 0 1"/>
  </material>
</visual>    

    <collision>
 <geometry>
    <cylinder length="0.03175" radius="0.0635"/>
 </geometry>
</collision>

   <inertial>
  <mass value="1"/>
  <inertia ixx="5.1458e-5" iyy="5.1458e-5" izz="6.125e-5"
           ixy="0" ixz="0" iyz="0"/>
</inertial>

</link>

edit retag flag offensive reopen merge delete

Closed for the following reason Gazebo Question: The Gazebo community prefers to answer questions at: http://answers.gazebosim.org by gvdhoorn
close date 2017-02-20 04:10:14.283053

Comments

This is really a Gazebo-specific question, which should be posted on answers.gazebosim.org.

gvdhoorn gravatar image gvdhoorn  ( 2017-02-20 04:10:58 -0500 )edit