From 8b46198cf07c99a97cdbe37505496eee51539905 Mon Sep 17 00:00:00 2001 From: =?UTF-8?q?Christoph=20Fr=C3=B6hlich?= Date: Thu, 4 Jan 2024 14:24:59 +0100 Subject: [PATCH] Fix yaml path in docs --- doc/index.rst | 2 +- 1 file changed, 1 insertion(+), 1 deletion(-) diff --git a/doc/index.rst b/doc/index.rst index 00a7ebb3..3369e4de 100644 --- a/doc/index.rst +++ b/doc/index.rst @@ -210,7 +210,7 @@ The following is a basic configuration of the controllers: - ``joint_state_broadcaster``: This controller publishes the state of all resources registered to a ``hardware_interface::StateInterface`` to a topic of type ``sensor_msgs/msg/JointState``. - ``joint_trajectory_controller``: This controller creates an action called ``/joint_trajectory_controller/follow_joint_trajectory`` of type ``control_msgs::action::FollowJointTrajectory``. -.. literalinclude:: ../gz_ros2_control_demos/config/cart_controller_position.yaml +.. literalinclude:: ../ign_ros2_control_demos/config/cart_controller_position.yaml :language: yaml