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