Gazebo | Ignition | Community
Ask Your Question
0

[gazebo-1] process has died with exit code 127. Cannot launch gazebo sim

asked 2018-05-08 09:02:27 -0500

this post is marked as community wiki

This post is a wiki. Anyone with karma >75 is welcome to improve it.

Hi! I am trying to launch my URDF file with Gazebo. Things were working just once, after reboot everything broken up. Everytime i am trying to launch my .launch file Gazebo died with exit code 127. What should i do to make it work again?

[ INFO] [1525786754.389744319, 0.136000000]: gazebo_ros_control plugin is waiting for model URDF in parameter [robot_description] on the ROS param server.
gzserver: symbol lookup error: /opt/ros/lunar/lib/libgazebo_ros_control.so: undefined symbol: _ZN22transmission_interface18TransmissionParser5parseERKNSt7__cxx1112basic_stringIcSt11char_traitsIcESaIcEEERSt6vectorINS_16TransmissionInfoESaISA_EE
[gazebo-1] process has died [pid 8513, exit code 127, cmd /opt/ros/lunar/lib/gazebo_ros/gzserver -e ode worlds/empty.world __name:=gazebo __log:=/home/dun/.ros/log/2f980c84-52c0-11e8-9564-6817295454f2/gazebo-1.log].
log file: /home/dun/.ros/log/2f980c84-52c0-11e8-9564-6817295454f2/gazebo-1*.log

My .xacro file

    <?xml version="1.0"?>
<robot xmlns:xacro="http://www.ros.org/wiki/xacro" name="kuka">
  <link
    name="base_link">
<-------------------------------->
  </joint>
  <gazebo>
    <plugin name="gazebo_ros_control" filename="libgazebo_ros_control.so">
      <robotNamespace>/</robotNamespace>
    </plugin>
  </gazebo>
</robot>

my .launch file

<launch>

    <arg name="paused" default="false"/>
  <arg name="use_sim_time" default="true"/>
  <arg name="gui" default="true"/>
  <arg name="headless" default="false"/>
  <arg name="debug" default="false"/>
    <arg name="model" 
        default="$(find kuka)/urdf/kuka.xacro"/>

    <include file="$(find gazebo_ros)/launch/empty_world.launch">
      <arg name="debug" value="$(arg debug)" />
      <arg name="gui" value="$(arg gui)" />
      <arg name="paused" value="$(arg paused)"/>
      <arg name="use_sim_time" value="$(arg use_sim_time)"/>
      <arg name="headless" value="$(arg headless)"/>
    </include>

    <!-- push robot_description to factory and spawn robot in gazebo -->
  <node 
    name="urdf_spawner" 
    pkg="gazebo_ros" 
    type="spawn_model"
    args="-file $(find kuka)/urdf/kuka.urdf.xacro -urdf -model kuka" 
    respawn="false" 
    output="screen"/>
    <node 
        pkg="robot_state_publisher" 
        type="robot_state_publisher"  
        name="robot_state_publisher">
      <param 
        name="publish_frequency" 
        type="double" 
        value="30.0" />
    </node>
</launch>

Here link to git [https://github.com/gostohov/kuka]

edit retag flag offensive close merge delete

Comments

This is a problem finding a symbol, I wouldn't look in your code. Make sure that you're using the right combination of gazebo, ros-lunar-gazebo<version>-ros-control, ros-lunar-gazebo<version>-ros-pkgs.

Carlos Agüero gravatar imageCarlos Agüero ( 2018-05-10 15:26:57 -0500 )edit

1 Answer

Sort by » oldest newest most voted
0

answered 2023-05-31 05:56:57 -0500

aki1608 gravatar image

I had same error in ros2. I think it is because of some mismatch as suggested by carlos in comment. What i did is to remove gazebo-controller from binary and clone the source from the git gazebo_ros2_control. This solved my issue.

(I had another issue as well "waiting for /controller_manager node to exists". This was solved as well.)

edit flag offensive delete link more

Question Tools

1 follower

Stats

Asked: 2018-05-08 09:02:27 -0500

Seen: 4,525 times

Last updated: May 08 '18