Robotics StackExchange | Archived questions

Weird texture when importing model from .dae mesh

Hi. I'm trying to import a .dae table to gazebo, but the material shows up wire-like and weird.

Here's the link to the table: https://3dwarehouse.sketchup.com/model/u1241c3de-9167-4d6d-9996-009149cdb354/laboratory-table

Here's the YouTube video I'm following to import the mesh and generate .config and .sdf files: https://youtu.be/l15ro77fnEM?t=535 (from 8:55) So this is what I did:

  1. Opened gazebo and went to Edit > Model Editor. Added the .dae mesh through Custom Shape. Set the name and model name. Did not set the table as static.
  2. Went to the generated .sdf file and deleted the auto-generated material tag set to Gazebo/Grey.
  3. Inserted the table through the insert tab and this is what I got.

bad texture

This is my model.sdf:

    <?xml version='1.0'?>
<sdf version='1.6'>
  <model name='labtable_reexported'>
    <link name='link_0'>
      <inertial>
        <mass>1</mass>
        <inertia>
          <ixx>0.166667</ixx>
          <ixy>0</ixy>
          <ixz>0</ixz>
          <iyy>0.166667</iyy>
          <iyz>0</iyz>
          <izz>0.166667</izz>
        </inertia>
      </inertial>
      <pose frame=''>0.503786 -1.42555 0 0 -0 0</pose>
      <visual name='visual'>
        <pose frame=''>0 0 0 0 -0 0</pose>
        <geometry>
          <mesh>
            <uri>/home/rovod/catkin_ws/src/computer-vision/modrob_cv_endeffector/models/furniture/laboratory+table/model_reexported.dae</uri>
            <scale>1 1 1</scale>
          </mesh>
        </geometry>
        <transparency>0</transparency>
        <cast_shadows>1</cast_shadows>
      </visual>
      <collision name='collision'>
        <laser_retro>0</laser_retro>
        <max_contacts>10</max_contacts>
        <pose frame=''>0 0 0 0 -0 0</pose>
        <geometry>
          <mesh>
            <uri>/home/rovod/catkin_ws/src/computer-vision/modrob_cv_endeffector/models/furniture/laboratory+table/model_reexported.dae</uri>
            <scale>1 1 1</scale>
          </mesh>
        </geometry>
        <surface>
          <friction>
            <ode>
              <mu>1</mu>
              <mu2>1</mu2>
              <fdir1>0 0 0</fdir1>
              <slip1>0</slip1>
              <slip2>0</slip2>
            </ode>
            <torsional>
              <coefficient>1</coefficient>
              <patch_radius>0</patch_radius>
              <surface_radius>0</surface_radius>
              <use_patch_radius>1</use_patch_radius>
              <ode>
                <slip>0</slip>
              </ode>
            </torsional>
          </friction>
          <bounce>
            <restitution_coefficient>0</restitution_coefficient>
            <threshold>1e+06</threshold>
          </bounce>
          <contact>
            <collide_without_contact>0</collide_without_contact>
            <collide_without_contact_bitmask>1</collide_without_contact_bitmask>
            <collide_bitmask>1</collide_bitmask>
            <ode>
              <soft_cfm>0</soft_cfm>
              <soft_erp>0.2</soft_erp>
              <kp>1e+13</kp>
              <kd>1</kd>
              <max_vel>0.01</max_vel>
              <min_depth>0</min_depth>
            </ode>
            <bullet>
              <split_impulse>1</split_impulse>
              <split_impulse_penetration_threshold>-0.01</split_impulse_penetration_threshold>
              <soft_cfm>0</soft_cfm>
              <soft_erp>0.2</soft_erp>
              <kp>1e+13</kp>
              <kd>1</kd>
            </bullet>
          </contact>
        </surface>
      </collision>
    </link>
    <static>0</static>
    <allow_auto_disable>1</allow_auto_disable>
  </model>
</sdf>

I'm using Ubuntu 18.04.5 with Gazebo 9.0.0 and ROS melodic.

Asked by hunny154 on 2021-02-11 03:58:03 UTC

Comments

Answers