preventing bouncing of object?
I have created an movable 3 wheel object ... but the problem is when i increase its velocity suddenly it begins to bounce .How exactly do i stop this from happening
<?xml version="1.0"?>
<robot xmlns:gazebo="http://playerstage.sourceforge.net/gazebo/xmlschema/#gz"
xmlns:model="http://playerstage.sourceforge.net/gazebo/xmlschema/#model"
xmlns:sensor="http://playerstage.sourceforge.net/gazebo/xmlschema/#sensor"
xmlns:body="http://playerstage.sourceforge.net/gazebo/xmlschema/#body"
xmlns:geom="http://playerstage.sourceforge.net/gazebo/xmlschema/#geom"
xmlns:joint="http://playerstage.sourceforge.net/gazebo/xmlschema/#joint"
xmlns:controller="http://playerstage.sourceforge.net/gazebo/xmlschema/#controller"
xmlns:interface="http://playerstage.sourceforge.net/gazebo/xmlschema/#interface"
xmlns:rendering="http://playerstage.sourceforge.net/gazebo/xmlschema/#rendering"
xmlns:physics="http://playerstage.sourceforge.net/gazebo/xmlschema/#physics"
name="test">
<link name="base_footprint"/>
<!--BASE Link-->
<link name="base_link">
<inertial>
<mass value="100"/>
<inertia ixx="1000" ixy="0" ixz="0" iyy="800" iyz="0" izz="600" />
</inertial>
<visual>
<geometry>
<box size="0.3 0.4 0.1"/>
</geometry>
</visual>
<collision>
<geometry>
<box size="0.3 0.4 0.1"/>
</geometry>
</collision>
</link>
<!--Left Wheel-->
<link name="left_wheel">
<inertial>
<mass value="1"/>
<inertia ixx="10" ixy="0" ixz="0" iyy="80" iyz="0" izz="60" />
</inertial>
<visual>
<origin xyz="0 0 0" rpy="0 1.57 0" />
<geometry>
<cylinder length="0.02" radius="0.1"/>
</geometry>
</visual>
<collision>
<origin xyz="0 0 0" rpy="0 1.57 0" />
<geometry>
<cylinder length="0.02" radius="0.1"/>
</geometry>
<surface>
<friction>
<torsional>
<coefficient>10000.0</coefficient>
<surface_radius>0.5</surface_radius>
<use_patch_radius>false</use_patch_radius>
</torsional>
</friction>
</surface>
</collision>
</link>
<!--Right wheel-->
<link name="right_wheel">
<inertial>
<mass value="1"/>
<inertia ixx="10" ixy="0" ixz="0" iyy="80" iyz="0" izz="60" />
</inertial>
<visual>
<origin xyz="0 0 0" rpy="0 1.57 0" />
<geometry>
<cylinder length="0.02" radius="0.1"/>
</geometry>
</visual>
<collision>
<origin xyz="0 0 0" rpy="0 1.57 0" />
<geometry>
<cylinder length="0.02" radius="0.1"/>
</geometry>
<surface>
<friction>
<torsional>
<coefficient>10000.0</coefficient>
<surface_radius>0.5</surface_radius>
<use_patch_radius>false</use_patch_radius>
</torsional>
</friction>
</surface>
</collision>
</link>
<!--front wheel-->
<link name="front_wheel">
<inertial>
<mass value="1"/>
<inertia ixx="10" ixy="0" ixz="0" iyy="80" iyz="0" izz="60" />
</inertial>
<visual>
<origin xyz="0 0 0" rpy="0 1.57 0" />
<geometry>
<cylinder length="0.02" radius="0.1"/>
</geometry>
</visual>
<collision>
<origin xyz="0 0 0" rpy="0 1.57 0" />
<geometry>
<cylinder length="0.02" radius="0.1"/>
</geometry>
<surface>
<friction>
<torsional>
<coefficient>10000.0</coefficient>
<surface_radius>0.5</surface_radius>
<use_patch_radius>false</use_patch_radius>
</torsional>
</friction>
</surface>
</collision>
</link>
<!--CONNECTORS WHEEL TO BODY-->
<!--link name="left_connector">
<inertial>
<mass value="1"/>
<inertia ixx="10" ixy="0" ixz="0" iyy="8" iyz="0" izz="6" />
</inertial>
<visual>
<origin xyz="0 0 0" rpy="0 1.57 0" />
<geometry>
<cylinder length="0.02" radius="0.05"/>
</geometry>
</visual>
<collision>
<origin xyz="0 0 0" rpy="0 1.57 0" />
<geometry>
<cylinder length="0.02" radius="0.05"/>
</geometry>
</collision>
</link-->
<!--link name="right_connector">
<inertial>
<mass ...
Could you share the vehicle's SDF? Maybe share a video of what you're observing? How are you controlling its velocity?
i control it through ros rqt. is there anyway that i can reduce the bouncing and skidding of the bot.. im using gazebo 2.2 as the latest models are not that compatable with ros ..this is in urdf format @chapulina