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
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