Gazebo | Ignition | Community
Ask Your Question

Revision history [back]

click to hide/show revision 1
initial version

URDF models inertia reasonable value

Dear altruists, I have a robot model and its main body is mentioned here. Body size is a hollow cover of (0.90.90.5) cubic meters. weight nearly 14 kilo, is inertia got from meshlab here is reasonable? and approximately how much effort is required for lifting five times this wight (1459.8 N)?

<link name="body">        
    <inertial>
        <origin xyz="0 0 0" rpy="0 0 0"/>
        <mass value="14.1"/>  
 <inertia ixx="-2685.745" ixy="47.8420869" ixz="-13.070708" iyy="4702.4455" iyz="864.4434" izz="1845.634138"/>
    </inertial>
    <visual>
        <material name="Yellow"/>
        <origin xyz="0 0 0" rpy="0 0 0"/>
        <geometry>
            <mesh filename="package://tt_tutorial/meshes/body.stl" scale="0.001 0.001 0.001"/>
        </geometry>
    </visual>
    <collision>
        <material name="Red"/>
        <origin xyz="0.0 0.0 0.0" rpy="0 0 0"/>
        <geometry>               
            <mesh filename="package://tt_tutorial/meshes/body.stl" scale="0.001 0.001 0.001"/>
        </geometry>
    </collision>
     <turnGravityOff>true</turnGravityOff>
  <gazebo reference="base_link">  
  </gazebo>
</link>

URDF models inertia reasonable value

Dear altruists, I have a robot model and its main body is mentioned here. Body size is a hollow cover of (0.90.90.5) cubic meters. weight nearly 14 kilo, is inertia got from meshlab here is reasonable? and approximately how much effort is required for lifting five times this wight (1459.8 N)?

<link name="body">        
    <inertial>
        <origin xyz="0 0 0" rpy="0 0 0"/>
        <mass value="14.1"/>  
 <inertia ixx="-2685.745" ixy="47.8420869" ixz="-13.070708" iyy="4702.4455" iyz="864.4434" izz="1845.634138"/>
    </inertial>
    <visual>
        <material name="Yellow"/>
        <origin xyz="0 0 0" rpy="0 0 0"/>
        <geometry>
            <mesh filename="package://tt_tutorial/meshes/body.stl" scale="0.001 0.001 0.001"/>
        </geometry>
    </visual>
    <collision>
        <material name="Red"/>
        <origin xyz="0.0 0.0 0.0" rpy="0 0 0"/>
        <geometry>               
            <mesh filename="package://tt_tutorial/meshes/body.stl" scale="0.001 0.001 0.001"/>
        </geometry>
    </collision>
     <turnGravityOff>true</turnGravityOff>
  <gazebo reference="base_link">  
  </gazebo>
</link>