Revolute/Continuous joints not loading in Gazebo [closed]

asked 2021-01-10 10:18:22 -0500

hanks gravatar image

updated 2022-06-05 11:42:49 -0500

lucasw gravatar image

I am making a cargo cart to attach to a Clearpath Robotics Ridgeback robot but my revolute and continuous joints don't seem to load in Gazebo. The colors defined for links also don't load in Gazebo.

I am attaching the code that I have added to the Ridgeback urdf file in order to incorporate the cart. Please take a look and help me with the issue.

<joint name="tow_hitch_joint" type="fixed">
  <origin xyz="-0.319 0 0.280" rpy="0 0 0" />
  <parent link="top_link"/>
  <child link="tow_hitch_link" />
</joint>

<link name="tow_hitch_link">
  <visual>
    <origin xyz="0 0 0.0125" rpy="0 0 0" />
    <geometry>
      <cylinder radius="0.05" length="0.025"/>
    </geometry>
    <material name="yellow"/>
  </visual>
  <collision>
    <origin xyz="0 0 0.0125"/>
    <geometry>
      <cylinder radius="0.05" length="0.025"/>
    </geometry>
  </collision>
</link>

<joint name="cargo_cart_joint" type="revolute">
  <origin xyz="0 0 0.025" rpy="0 0 0" />
  <parent link="tow_hitch_link"/>
  <child link="cargo_cart_link" />
  <axis xyz="0 0 1" />
  <limit effort="0" lower="-0.785" upper="0.785" velocity="0" />
</joint>

<link name="cargo_cart_link">
  <visual>
    <origin xyz="-0.2 0 0.0125" rpy="0 0 0" />
    <geometry>
      <box size="0.5 0.643 0.025"/>
      <material name="black"/>
    </geometry>
  </visual>
  <collision>
    <origin xyz="-0.2 0 0.0125"/>
    <geometry>
      <box size="0.5 0.643 0.025"/>
    </geometry>
  </collision>
  <inertial>
    <origin xyz="0 0 0" rpy="0 0 0"/>
    <mass value="0.05"/>
    <inertia
      ixx="4.4744" ixy="0.03098" ixz="0.003647"
      iyy="7.1624" iyz="0.1228"
      izz="4.6155"/>
  </inertial>
</link>
edit retag flag offensive reopen merge delete

Closed for the following reason the question is answered, right answer was accepted by hanks
close date 2021-01-13 22:47:18.703127