Gazebo | Ignition | Community
Ask Your Question
0

no texture in gazebo with sw_urdf_exporter

asked 2018-05-08 05:02:04 -0500

image description above is test model in solidwork 2017. the urdf is:

<robot
  name="Part1">
  <link
    name="Part1">
    <inertial>
      <origin
        xyz="0.01494 0.0058461 0.005"
        rpy="0 0 0" />
      <mass
        value="0.019735" />
      <inertia
        ixx="6.70660759226523E-06"
        ixy="2.43391976571625E-07"
        ixz="-4.43715000683748E-23"
        iyy="1.82003927243728E-06"
        iyz="2.68535879956309E-22"
        izz="8.19773544892975E-06" />
    </inertial>
    <visual>
      <origin
        xyz="0 0 0"
        rpy="1.5707963267949 0 0" />
      <geometry>
        <mesh
          filename="package://Part1/meshes/Part1.STL" />
      </geometry>
      <material
        name="">
        <color
          rgba="1 0.16863 0.16863 1" />
      </material>
    </visual>
    <collision>
      <origin
        xyz="0 0 0"
        rpy="1.5707963267949 0 0" />
      <geometry>
        <mesh
          filename="package://Part1/meshes/Part1.STL" />
      </geometry>
    </collision>
  </link>
</robot>

when I launch this urdf in gazebo/rviz can't see texture its plain white.

edit retag flag offensive close merge delete

Comments

3D modellers usually have several options to modify when exporting. This is a wild guess but check if you have any options concerning exporting textures that you can tick when exporting the model as .stl. In Blender for example there is an option that if left unticked, you're textures won't get exported along with the model.

Raskkii gravatar imageRaskkii ( 2018-05-08 08:38:35 -0500 )edit

1 Answer

Sort by ยป oldest newest most voted
0

answered 2018-05-08 06:38:05 -0500

PeteBlackerThe3rd gravatar image

Just answered this one for you over on ROS Answers.

edit flag offensive delete link more

Question Tools

1 follower

Stats

Asked: 2018-05-08 05:02:04 -0500

Seen: 217 times

Last updated: May 08 '18