Gazebo | Ignition | Community
Ask Your Question

Revision history [back]

click to hide/show revision 1
initial version

gazebo fails to load ign_ros2_control-system plugin

gazebo: gazebo citadel ros distro: foxy installed binaries: ros-foxy-ignition-citadel,ros-foxy-ign-ros2-control and ros-foxy-ign-ros2-control-demos

I was trying to setup the <ros2_control> tag for my robot to use with the ign_ros2_control/IgnitionSystem plugin, however when I try to spawn the robot into empty gazebo world, I get the following error message in the gazebo terminal

lukas@DESKTOP-QRS1BRB:~$ ign gazebo empty.sdf
QStandardPaths: XDG_RUNTIME_DIR not set, defaulting to '/tmp/runtime-lukas'
[Err] [SystemLoader.cc:66] Failed to load system plugin [ign_ros2_control-system]: couldn't find shared library.

here is the <ros2_control> tag

<ros2_control name="IgnitionSystem" type="system">
    <hardware>
      <plugin>ign_ros2_control/IgnitionSystem</plugin>
    </hardware>
    <joint name="link_1_joint">
      <command_interface name="position">
        <param name="min">-15</param>
        <param name="max">15</param>
      </command_interface>
      <state_interface name="position"/>
      <state_interface name="velocity"/>
      <state_interface name="effort"/>
    </joint>
  </ros2_control>

   <gazebo>
    <!-- Joint state publisher -->
    <plugin filename="libign_ros2_control-system.so" name="ign_ros2_control">
      <robot_param>robot_description</robot_param>
      <robot_param_node>robot_state_publisher</robot_param_node>
      <parameters>$(find inobot_config)/config/ros_controllers.yaml</parameters>
    </plugin>
  </gazebo>

None of the demos work neither, when I try to launch the cart position demo I get the following output with no working system

log.txt

Let me know if this is not the right place to post this issue as I am unsure if this is issue with gazebo or gz_ros2_control, however I keep getting the same error msg (i.e. Failed to load system plugin) for other plugins such as diff_drive, camera, imu

gazebo fails to load ign_ros2_control-system plugin

gazebo: gazebo citadel ros distro: foxy installed binaries: ros-foxy-ignition-citadel,ros-foxy-ign-ros2-control and ros-foxy-ign-ros2-control-demos

I was trying to setup the <ros2_control> tag for my robot to use with the ign_ros2_control/IgnitionSystem plugin, however when I try to spawn the robot into empty gazebo world, I get the following error message in the gazebo terminal

lukas@DESKTOP-QRS1BRB:~$ ign gazebo empty.sdf
QStandardPaths: XDG_RUNTIME_DIR not set, defaulting to '/tmp/runtime-lukas'
[Err] [SystemLoader.cc:66] Failed to load system plugin [ign_ros2_control-system]: couldn't find shared library.

here is the <ros2_control> tag

<ros2_control name="IgnitionSystem" type="system">
    <hardware>
      <plugin>ign_ros2_control/IgnitionSystem</plugin>
    </hardware>
    <joint name="link_1_joint">
      <command_interface name="position">
        <param name="min">-15</param>
        <param name="max">15</param>
      </command_interface>
      <state_interface name="position"/>
      <state_interface name="velocity"/>
      <state_interface name="effort"/>
    </joint>
  </ros2_control>

   <gazebo>
    <!-- Joint state publisher -->
    <plugin filename="libign_ros2_control-system.so" name="ign_ros2_control">
      <robot_param>robot_description</robot_param>
      <robot_param_node>robot_state_publisher</robot_param_node>
      <parameters>$(find inobot_config)/config/ros_controllers.yaml</parameters>
    </plugin>
  </gazebo>

None of the demos work neither, when I try to launch the cart position demo I get the following output with no working system

log.txt

Let me know if this is not the right place to post this issue as I am unsure if this is issue with gazebo or gz_ros2_control, however I keep getting the same error msg (i.e. Failed to load system plugin) for other plugins such as diff_drive, camera, imu

1664774096.8416636 [INFO] [launch]: All log files can be found below /home/lukas/.ros/log/2022-10-03-06-14-56-834269-DESKTOP-QRS1BRB-19283 1664774096.8420956 [INFO] [launch]: Default logging verbosity is set to INFO 1664774097.0093417 [INFO] [ign gazebo-1]: process started with pid [19288] 1664774097.0096638 [INFO] [robot_state_publisher-2]: process started with pid [19291] 1664774097.0098433 [INFO] [create-3]: process started with pid [19293] 1664774097.4934983 [INFO] [create-3]: process has finished cleanly [pid 19293] 1664774097.5219979 [INFO] [ros2-4]: process started with pid [19356] 1664774108.1720819 [WARNING] [launch]: user interrupted with ctrl-c (SIGINT) 1664774108.1955278 [INFO] [robot_state_publisher-2]: process has finished cleanly [pid 19291] 1664774108.3028009 [ERROR] [ros2-4]: process has died [pid 19356, exit code 2, cmd 'ros2 control load_controller --set-state start joint_state_broadcaster']. 1664774113.1790979 [ERROR] [ign gazebo-1]: process[ign gazebo-1] failed to terminate '5' seconds after receiving 'SIGINT', escalating to 'SIGTERM' 1664774113.1800406 [INFO] [ign gazebo-1]: sending signal 'SIGTERM' to process[ign gazebo-1] 1664774113.1809649 [ERROR] [ign gazebo-1]: process has died [pid 19288, exit code -15, cmd 'ign gazebo -r -v 4 empty.sdf'].

gazebo fails to load ign_ros2_control-system plugin

gazebo: gazebo citadel ros distro: foxy installed binaries: ros-foxy-ignition-citadel,ros-foxy-ign-ros2-control and ros-foxy-ign-ros2-control-demos

I was trying to setup the <ros2_control> tag for my robot to use with the ign_ros2_control/IgnitionSystem plugin, however when I try to spawn the robot into empty gazebo world, I get the following error message in the gazebo terminal

lukas@DESKTOP-QRS1BRB:~$ ign gazebo empty.sdf
QStandardPaths: XDG_RUNTIME_DIR not set, defaulting to '/tmp/runtime-lukas'
[Err] [SystemLoader.cc:66] Failed to load system plugin [ign_ros2_control-system]: couldn't find shared library.

here is the <ros2_control> tag

<ros2_control name="IgnitionSystem" type="system">
    <hardware>
      <plugin>ign_ros2_control/IgnitionSystem</plugin>
    </hardware>
    <joint name="link_1_joint">
      <command_interface name="position">
        <param name="min">-15</param>
        <param name="max">15</param>
      </command_interface>
      <state_interface name="position"/>
      <state_interface name="velocity"/>
      <state_interface name="effort"/>
    </joint>
  </ros2_control>

   <gazebo>
    <!-- Joint state publisher -->
    <plugin filename="libign_ros2_control-system.so" name="ign_ros2_control">
      <robot_param>robot_description</robot_param>
      <robot_param_node>robot_state_publisher</robot_param_node>
      <parameters>$(find inobot_config)/config/ros_controllers.yaml</parameters>
    </plugin>
  </gazebo>

None of the demos work neither, when I try to launch the cart position demo I get the following output with no working system

log.txt

Let me know if this is not the right place to post this issue as I am unsure if this is issue with gazebo or gz_ros2_control, however I keep getting the same error msg (i.e. Failed to load system plugin) for other plugins such as diff_drive, camera, imu

1664774096.8416636 [INFO] [launch]: All log files can be found below /home/lukas/.ros/log/2022-10-03-06-14-56-834269-DESKTOP-QRS1BRB-19283 1664774096.8420956 [INFO] [launch]: Default logging verbosity is set to INFO 1664774097.0093417 [INFO] [ign gazebo-1]: process started with pid [19288] 1664774097.0096638 [INFO] [robot_state_publisher-2]: process started with pid [19291] 1664774097.0098433 [INFO] [create-3]: process started with pid [19293] 1664774097.4934983 [INFO] [create-3]: process has finished cleanly [pid 19293] 1664774097.5219979 [INFO] [ros2-4]: process started with pid [19356] 1664774108.1720819 [WARNING] [launch]: user interrupted with ctrl-c (SIGINT) 1664774108.1955278 [INFO] [robot_state_publisher-2]: process has finished cleanly [pid 19291] 1664774108.3028009 [ERROR] [ros2-4]: process has died [pid 19356, exit code 2, cmd 'ros2 control load_controller --set-state start joint_state_broadcaster']. 1664774113.1790979 [ERROR] [ign gazebo-1]: process[ign gazebo-1] failed to terminate '5' seconds after receiving 'SIGINT', escalating to 'SIGTERM' 1664774113.1800406 [INFO] [ign gazebo-1]: sending signal 'SIGTERM' to process[ign gazebo-1] 1664774113.1809649 [ERROR] [ign gazebo-1]: process has died [pid 19288, exit code -15, cmd 'ign gazebo -r -v 4 empty.sdf'].empty.sdf'].

gazebo fails to load ign_ros2_control-system plugin

gazebo: gazebo citadel ros distro: foxy installed binaries: ros-foxy-ignition-citadel,ros-foxy-ign-ros2-control and ros-foxy-ign-ros2-control-demos

I was trying to setup the <ros2_control> tag for my robot to use with the ign_ros2_control/IgnitionSystem plugin, however when I try to spawn the robot into empty gazebo world, I get the following error message in the gazebo terminal

lukas@DESKTOP-QRS1BRB:~$ ign gazebo empty.sdf
QStandardPaths: XDG_RUNTIME_DIR not set, defaulting to '/tmp/runtime-lukas'
[Err] [SystemLoader.cc:66] Failed to load system plugin [ign_ros2_control-system]: couldn't find shared library.

here is the <ros2_control> tag

<ros2_control name="IgnitionSystem" type="system">
    <hardware>
      <plugin>ign_ros2_control/IgnitionSystem</plugin>
    </hardware>
    <joint name="link_1_joint">
      <command_interface name="position">
        <param name="min">-15</param>
        <param name="max">15</param>
      </command_interface>
      <state_interface name="position"/>
      <state_interface name="velocity"/>
      <state_interface name="effort"/>
    </joint>
  </ros2_control>

   <gazebo>
    <!-- Joint state publisher -->
    <plugin filename="libign_ros2_control-system.so" name="ign_ros2_control">
      <robot_param>robot_description</robot_param>
      <robot_param_node>robot_state_publisher</robot_param_node>
      <parameters>$(find inobot_config)/config/ros_controllers.yaml</parameters>
    </plugin>
  </gazebo>

None of the demos work neither, when I try to launch the cart position demo I get the following output with no working system

log.txt

Let me know if this is not the right place to post this issue as I am unsure if this is issue with gazebo or gz_ros2_control, however I keep getting the same error msg (i.e. Failed to load system plugin) for other plugins such as diff_drive, camera, imu

1664774096.8416636 [INFO] [launch]: All log files can be found below /home/lukas/.ros/log/2022-10-03-06-14-56-834269-DESKTOP-QRS1BRB-19283
1664774096.8420956 [INFO] [launch]: Default logging verbosity is set to INFO
1664774097.0093417 [INFO] [ign gazebo-1]: process started with pid [19288]
1664774097.0096638 [INFO] [robot_state_publisher-2]: process started with pid [19291]
1664774097.0098433 [INFO] [create-3]: process started with pid [19293]
1664774097.4934983 [INFO] [create-3]: process has finished cleanly [pid 19293]
1664774097.5219979 [INFO] [ros2-4]: process started with pid [19356]
1664774108.1720819 [WARNING] [launch]: user interrupted with ctrl-c (SIGINT)
1664774108.1955278 [INFO] [robot_state_publisher-2]: process has finished cleanly [pid 19291]
1664774108.3028009 [ERROR] [ros2-4]: process has died [pid 19356, exit code 2, cmd 'ros2 control load_controller --set-state start joint_state_broadcaster'].
1664774113.1790979 [ERROR] [ign gazebo-1]: process[ign gazebo-1] failed to terminate '5' seconds after receiving 'SIGINT', escalating to 'SIGTERM'
1664774113.1800406 [INFO] [ign gazebo-1]: sending signal 'SIGTERM' to process[ign gazebo-1]
1664774113.1809649 [ERROR] [ign gazebo-1]: process has died [pid 19288, exit code -15, cmd 'ign gazebo  -r -v 4 empty.sdf'].

gazebo fails to load ign_ros2_control-system plugin

gazebo: gazebo citadel ros distro: foxy installed binaries: ros-foxy-ignition-citadel,ros-foxy-ign-ros2-control and ros-foxy-ign-ros2-control-demos

I was trying to setup the <ros2_control> tag for my robot to use with the ign_ros2_control/IgnitionSystem plugin, however when I try to spawn the robot into empty gazebo world, I get the following error message in the gazebo terminal

lukas@DESKTOP-QRS1BRB:~$ ign gazebo empty.sdf
QStandardPaths: XDG_RUNTIME_DIR not set, defaulting to '/tmp/runtime-lukas'
[Err] [SystemLoader.cc:66] Failed to load system plugin [ign_ros2_control-system]: couldn't find shared library.

here is the <ros2_control> tag

<ros2_control name="IgnitionSystem" type="system">
    <hardware>
      <plugin>ign_ros2_control/IgnitionSystem</plugin>
    </hardware>
    <joint name="link_1_joint">
      <command_interface name="position">
        <param name="min">-15</param>
        <param name="max">15</param>
      </command_interface>
      <state_interface name="position"/>
      <state_interface name="velocity"/>
      <state_interface name="effort"/>
    </joint>
  </ros2_control>

   <gazebo>
    <!-- Joint state publisher -->
    <plugin filename="libign_ros2_control-system.so" name="ign_ros2_control">
      <robot_param>robot_description</robot_param>
      <robot_param_node>robot_state_publisher</robot_param_node>
      <parameters>$(find inobot_config)/config/ros_controllers.yaml</parameters>
    </plugin>
  </gazebo>

None of the demos work neither, when I try to launch the cart position demo I get the following output with no working system

log.txt

Let me know if this is not the right place to post this issue as I am unsure if this is issue with gazebo or gz_ros2_control, however I keep getting the same error msg (i.e. Failed to load system plugin) for other plugins such as diff_drive, camera, imu

Here is the output of the launch.log

1664774096.8416636 [INFO] [launch]: All log files can be found below /home/lukas/.ros/log/2022-10-03-06-14-56-834269-DESKTOP-QRS1BRB-19283
1664774096.8420956 [INFO] [launch]: Default logging verbosity is set to INFO
1664774097.0093417 [INFO] [ign gazebo-1]: process started with pid [19288]
1664774097.0096638 [INFO] [robot_state_publisher-2]: process started with pid [19291]
1664774097.0098433 [INFO] [create-3]: process started with pid [19293]
1664774097.4934983 [INFO] [create-3]: process has finished cleanly [pid 19293]
1664774097.5219979 [INFO] [ros2-4]: process started with pid [19356]
1664774108.1720819 [WARNING] [launch]: user interrupted with ctrl-c (SIGINT)
1664774108.1955278 [INFO] [robot_state_publisher-2]: process has finished cleanly [pid 19291]
1664774108.3028009 [ERROR] [ros2-4]: process has died [pid 19356, exit code 2, cmd 'ros2 control load_controller --set-state start joint_state_broadcaster'].
1664774113.1790979 [ERROR] [ign gazebo-1]: process[ign gazebo-1] failed to terminate '5' seconds after receiving 'SIGINT', escalating to 'SIGTERM'
1664774113.1800406 [INFO] [ign gazebo-1]: sending signal 'SIGTERM' to process[ign gazebo-1]
1664774113.1809649 [ERROR] [ign gazebo-1]: process has died [pid 19288, exit code -15, cmd 'ign gazebo  -r -v 4 empty.sdf'].