You signed in with another tab or window. Reload to refresh your session.You signed out in another tab or window. Reload to refresh your session.You switched accounts on another tab or window. Reload to refresh your session.Dismiss alert
All the examples crashe immediately with no log or specific error message.
Example for ros2 launch mujoco_ros2_control_demos cart_example_position.launch.py
Same behavior for both the main and humble-devel branches.
Digging a little bit it seems like calls to controller_manager (read/write and update) in the update() method of MujocoRos2Control provoke the problem?
Well, oddly enough, it works if I compile everything in debug mode with: colcon build --packages-select mujoco_ros2_control --symlink-install --cmake-args -DCMAKE_BUILD_TYPE=Debug
All the examples crashe immediately with no log or specific error message.
Example for
ros2 launch mujoco_ros2_control_demos cart_example_position.launch.py
Same behavior for both the main and humble-devel branches.
Digging a little bit it seems like calls to controller_manager (read/write and update) in the update() method of MujocoRos2Control provoke the problem?
mujoco_ros2_control/mujoco_ros2_control/src/mujoco_ros2_control.cpp
Line 144 in ba232c0
Any idea?
Tested under:
The text was updated successfully, but these errors were encountered: