diff --git a/CMakeLists.txt b/CMakeLists.txt
index 461a9b6..0235da1 100644
--- a/CMakeLists.txt
+++ b/CMakeLists.txt
@@ -11,6 +11,7 @@ find_package(ament_cmake REQUIRED)
find_package(controller_manager REQUIRED)
find_package(Eigen3 REQUIRED)
find_package(glfw3 REQUIRED)
+find_package(control_toolbox REQUIRED)
find_package(hardware_interface REQUIRED)
find_package(pluginlib REQUIRED)
find_package(rclcpp REQUIRED)
@@ -158,6 +159,7 @@ target_link_libraries(mujoco_ros2_simulation
pluginlib::pluginlib
rclcpp::rclcpp
rclcpp_lifecycle::rclcpp_lifecycle
+ control_toolbox::control_toolbox
sensor_msgs::sensor_msgs_library
Eigen3::Eigen
Threads::Threads
diff --git a/README.md b/README.md
index 151a1b0..354a691 100644
--- a/README.md
+++ b/README.md
@@ -51,6 +51,11 @@ Just specify the plugin and point to a valid MJCF on launch:
mujoco_ros2_simulation/MujocoSystemInterface
$(find my_description)/description/scene.xml
+
+ $(find my_description)/config/pids.yaml
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+ mujoco_ros2_simulation/MujocoSystemInterface
+ $(find mujoco_ros2_simulation)/test_resources/test_pid/scene_pid.xml
+
+ $(find mujoco_ros2_simulation)/config/mujoco_pid.yaml
+
+
+ 3.0
+
+
+ 6.0
+
+
+ 10.0
+
+
+
+
+
+
+ 0.0
+
+
+
+
+
+
+
+
+
+ 0.0
+
+
+
+
+
+
+
+
+ camera_color_mujoco_frame
+ /camera/color/camera_info
+ /camera/color/image_raw
+ /camera/aligned_depth_to_color/image_raw
+
+
+
+
+
+
+
+ lidar_sensor_frame
+ 0.025
+ -0.3
+ 0.3
+ 0.05
+ 10
+ /scan
+
+
+
+
diff --git a/test/test_resources/test_pid/test_robot_pid.xml b/test/test_resources/test_pid/test_robot_pid.xml
new file mode 100644
index 0000000..52c9063
--- /dev/null
+++ b/test/test_resources/test_pid/test_robot_pid.xml
@@ -0,0 +1,51 @@
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+
+