Robotics StackExchange | Archived questions

"gz sdf -k file" completes check but makes Gazebo crash

I have an URDF file. It's actually the clearpath husky with these this added.

  <link name="bowler_link">
    <visual>
      <geometry>
        <mesh filename="$(find husky_description)/meshes/red_bowler.dae" />
      </geometry>
    </visual>
    <collision>
      <origin xyz="0 0 0.07" rpy="0 0 0" />
      <geometry>
        <box size="0.32 0.25 0.14" rpy="0 0 0"/>
      </geometry>
    </collision>
  </link>

  <joint name="bowler_joint" type="fixed">
    <parent link="base_link" />
    <child link="bowler_link" />
    <origin xyz="0.1 -0.1 0" rpy="0 0 0.5" />
  </joint>

If I remove these lines, Gazebo works just fine. But when I add them, Gazebo crashes. The command line Gazebo tool tells me this is fine.

xacro husky.urdf.xacro > h.urdf
gz sdf -k h.urdf 
Check complete

When I run

[gazebo_gui-3] process has died [pid 22440, exit code 139, cmd /opt/ros/kinetic/lib/gazebo_ros/gzclient __name:=gazebo_gui __log:=/home/cedric/.ros/log/82f291a6-c20d-11ea-9047-34e6d75eecc8/gazebo_gui-3.log].
log file: /home/cedric/.ros/log/82f291a6-c20d-11ea-9047-34e6d75eecc8/gazebo_gui-3*.log

Interestingly, this is what the folder /home/cedric/.ros/log/82f291a6-c20d-11ea-9047-34e6d75eecc8/ contains :

(venv) cedric@ubuntu-cedric:~/.ros/log/82f291a6-c20d-11ea-9047-34e6d75eecc8$ ls
base_controller_spawner-4.log         robot_state_publisher-7-stdout.log  spawn_husky_model-9.log
base_controller_spawner-4-stdout.log  roslaunch-ubuntu-cedric-22396.log   spawn_husky_model-9-stdout.log
ekf_localization-5-stdout.log         rosout-1-stdout.log                 twist_mux-8-stdout.log
master.log                            rosout.log

It does not contain the gazebo_gui-3*.log file

I'm not sure what is going on that is wrong here.

EDIT 1 :

After going in roscd gazebo_ros and modifying

image description

Asked by MartensCedric on 2020-07-09 14:22:29 UTC

Comments

Answers

Turns out the .dae file was invalid

Asked by MartensCedric on 2020-07-09 16:29:34 UTC

Comments