Skip to content

Commit 1834b79

Browse files
authored
Fix broken URLs in tutorials docs (#798)
1 parent 378b3d6 commit 1834b79

File tree

4 files changed

+11
-5
lines changed

4 files changed

+11
-5
lines changed

doc/examples/planning_with_approximated_constraint_manifolds/planning_with_approximated_constraint_manifolds_tutorial.rst

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -124,7 +124,7 @@ Such a constraint is compactly defined like this::
124124
Running the database generator
125125
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
126126

127-
Assuming MoveIt itself is already launched (via eg. ``roslaunch X_moveit_config demo.launch``), you can use a launch file similar to `generate_state_database.launch <https://github.com/ros-planning/moveit/blob/master/moveit_planners/ompl/ompl_interface/launch/generate_state_database.launch>`_
127+
Assuming MoveIt itself is already launched (via eg. ``roslaunch X_moveit_config demo.launch``), you can use a launch file similar to :moveit_codedir:`generate_state_database.launch <moveit_planners/ompl/ompl_interface/launch/generate_state_database.launch>`.
128128

129129
The file with the constraint definitions can be passed to the launch file::
130130

doc/how_to_guides/isaac_panda/isaac_panda_tutorial.rst

Lines changed: 3 additions & 3 deletions
Original file line numberDiff line numberDiff line change
@@ -56,19 +56,19 @@ updated to load the ``TopicBasedSystem`` plugin when the flag ``ros2_control_har
5656
</xacro:if>
5757
5858
In this tutorial we have included a Python script that loads a Panda robot
59-
and builds an `OmniGraph <https://docs.omniverse.nvidia.com/isaacsim/latest/tutorial_gui_omnigraph.html>`_
59+
and builds an `OmniGraph <https://docs.omniverse.nvidia.com/isaacsim/latest/gui_tutorials/tutorial_gui_omnigraph.html>`_
6060
to publish and subscribe to the ROS topics used to control the robot.
6161
The OmniGraph also contains nodes to publish RGB and Depth images from the camera mounted on the hand of the Panda.
6262
The RGB image is published to the topic ``/rgb``, the camera info to ``/camera_info``, and the depth image to ``/depth``.
6363
The frame ID of the camera frame is ``/sim_camera``.
6464
To learn about configuring your Isaac Sim robot to communicate with ROS 2 please see the
65-
`Joint Control tutorial <https://docs.omniverse.nvidia.com/isaacsim/latest/tutorial_ros2_manipulation.html>`_
65+
`Joint Control tutorial <https://docs.omniverse.nvidia.com/isaacsim/latest/ros2_tutorials/tutorial_ros2_manipulation.html>`_
6666
on Omniverse.
6767

6868
Computer Setup
6969
--------------
7070

71-
1. Install `Isaac Sim <https://docs.omniverse.nvidia.com/isaacsim/latest/install_workstation.html>`_.
71+
1. Install `Isaac Sim <https://docs.omniverse.nvidia.com/isaacsim/latest/installation/install_workstation.html>`_.
7272

7373
2. Perform a shallow clone of the MoveIt2 Tutorials repo.
7474

doc/tutorials/getting_started/getting_started.rst

Lines changed: 4 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -49,6 +49,8 @@ Install `vcstool <https://index.ros.org/d/python3-vcstool/>`_ : ::
4949

5050
sudo apt install python3-vcstool
5151

52+
.. _create_colcon_workspace:
53+
5254
Create A Colcon Workspace and Download Tutorials
5355
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^
5456
For tutorials you will need to have a :ros_documentation:`colcon <Tutorials/Colcon-Tutorial.html#install-colcon>` workspace setup. ::
@@ -106,6 +108,8 @@ Optional: add the previous command to your ``.bashrc``: ::
106108
not required and often skipped by advanced users who use more than one
107109
Colcon workspace at a time, but we recommend it for simplicity.
108110

111+
.. _cyclone_dds:
112+
109113
Switch to Cyclone DDS
110114
^^^^^^^^^^^^^^^^^^^^^
111115

doc/tutorials/quickstart_in_rviz/quickstart_in_rviz_tutorial.rst

Lines changed: 3 additions & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -7,7 +7,9 @@ This tutorial will teach you how to create motion plans in MoveIt using RViz and
77

88
Getting Started
99
---------------
10-
If you haven't already done so, make sure you've completed the steps in :doc:`Getting Started </doc/tutorials/getting_started/getting_started>` or our :doc:`Docker Guide </doc/how_to_guides/how_to_setup_docker_containers_in_ubuntu>`. If you followed the Docker Guide, also follow the second part of the Getting Started tutorial (from :ref:`Create a Colcon Workspace and Download Tutorials <doc/tutorials/getting_started/getting_started.html:create a colcon workspace and download tutorials>` onwards) to set up the tutorials. As of Sep 26, 2022, ensure you have enabled Cyclone DDS as described there.
10+
If you haven't already done so, make sure you've completed the steps in :doc:`Getting Started </doc/tutorials/getting_started/getting_started>` or our :doc:`Docker Guide </doc/how_to_guides/how_to_setup_docker_containers_in_ubuntu>`.
11+
If you followed the Docker Guide, also follow the :ref:`create_colcon_workspace` guide onwards to set up the tutorials.
12+
As of Sep 26, 2022, ensure you have :ref:`enabled Cyclone DDS <cyclone_dds>`.
1113

1214
Step 1: Launch the Demo and Configure the Plugin
1315
------------------------------------------------

0 commit comments

Comments
 (0)