Skip to content

Plugin not loading correctly in ROS 2 Kilted #13

@sea-bass

Description

@sea-bass

Describe the bug
I was able to build this package in ROS 2 Kilted but get a runtime error / failure to load the mujoco library at runtime.

To Reproduce
Steps to reproduce the behavior:

  1. Clone this repo
  2. After rosdep install, run colcon build -- builds fine
  3. Run the example: ros2 launch mujoco_ros2_simulation test_robot.launch.py
[ros2_control_node-2] [ERROR] [1764428272.472141404] [controller_manager]: 
Caught exception of type : N9pluginlib20LibraryLoadExceptionE while loading hardware: 
Failed to load library /home/sebastian/workspace/mujoco_ros_ws/install/mujoco_ros2_simulation/lib/mujoco_ros2_simulation/libmujoco_ros2_simulation.so. 
Make sure that you are calling the PLUGINLIB_EXPORT_CLASS macro in the library code, and that names are consistent between this macro and your XML. 
Error string: Could not load library dlopen error: libmujoco.so.3.3.4: cannot open shared object file: 
No such file or directory, at ./src/shared_library.c:96

Expected behavior
Should work

Screenshots
If applicable, add screenshots to help explain your problem.

Environment (please complete the following information):

  • OS: Ubuntu 24.04
  • Version: ROS 2 Kilted

I can confirm that I have this file auto-fetched and installed:

mujoco_ros2_simulation/mujoco/mujoco-3.3.4/lib/libmujoco.so.3.3.4

And I can ldd it just fine:

$ ldd mujoco/mujoco-3.3.4/lib/libmujoco.so.3.3.4
        linux-vdso.so.1 (0x000074f907256000)
        libdl.so.2 => /lib/x86_64-linux-gnu/libdl.so.2 (0x000074f90724b000)
        libm.so.6 => /lib/x86_64-linux-gnu/libm.so.6 (0x000074f906cf1000)
        libc.so.6 => /lib/x86_64-linux-gnu/libc.so.6 (0x000074f906a00000)
        /lib64/ld-linux-x86-64.so.2 (0x000074f907258000)
        libpthread.so.0 => /lib/x86_64-linux-gnu/libpthread.so.0 (0x000074f907244000)

Metadata

Metadata

Assignees

No one assigned

    Labels

    bugSomething isn't working

    Type

    No type

    Projects

    No projects

    Milestone

    No milestone

    Relationships

    None yet

    Development

    No branches or pull requests

    Issue actions