Skip to content
Draft
Show file tree
Hide file tree
Changes from all commits
Commits
File filter

Filter by extension

Filter by extension

Conversations
Failed to load comments.
Loading
Jump to
Jump to file
Failed to load files.
Loading
Diff view
Diff view
10 changes: 0 additions & 10 deletions CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -177,16 +177,6 @@ install(TARGETS mujoco_ros2_simulation
LIBRARY DESTINATION lib/${PROJECT_NAME}
)

# Install the ROS 2 control node
add_executable(ros2_control_node src/mujoco_ros2_control_node.cpp)
target_link_libraries(ros2_control_node PUBLIC
controller_manager::controller_manager
)
install(
TARGETS ros2_control_node
RUNTIME DESTINATION lib/${PROJECT_NAME}
)

# Install python tools
install(PROGRAMS
scripts/find_missing_inertias.py
Expand Down
20 changes: 0 additions & 20 deletions README.md
Original file line number Diff line number Diff line change
Expand Up @@ -75,26 +75,6 @@ Just specify the plugin and point to a valid MJCF on launch:
...
```

Due to compatibility issues, we use a [slightly modified ROS 2 control node](./src/mujoco_ros2_control_node.cpp).
It is the same executable and parameters as the upstream, but requires updating the launchfile:

```python
control_node = Node(
# Specify the control node from this package!
package="mujoco_ros2_simulation",
executable="ros2_control_node",
output="both",
parameters=[
{"use_sim_time": True},
controller_parameters,
],
)
```

> **_NOTE_**: We can remove the the ROS 2 control node after the next ros2_control upstream release,
as the simulation requires [this PR](https://github.com/ros-controls/ros2_control/pull/2654) to run.
The hardware interface _should_ then be compatible with `humble`, `jazzy`, and `kilted`.

### Joints

Joints in the ros2_control interface are mapped to actuators defined in the MJCF.
Expand Down
192 changes: 0 additions & 192 deletions src/mujoco_ros2_control_node.cpp

This file was deleted.

2 changes: 1 addition & 1 deletion test/launch/test_robot.launch.py
Original file line number Diff line number Diff line change
Expand Up @@ -60,7 +60,7 @@ def generate_launch_description():
)

control_node = Node(
package="mujoco_ros2_simulation",
package="controller_manager",
executable="ros2_control_node",
output="both",
parameters=[
Expand Down
Loading