Skip to content

Commit 8504fd3

Browse files
mpgussertkellyguo11
authored andcommitted
Fixes broken links in the documentation (#3500)
## Checklist - [x] I have read and understood the [contribution guidelines](https://isaac-sim.github.io/IsaacLab/main/source/refs/contributing.html) - [x] I have run the [`pre-commit` checks](https://pre-commit.com/) with `./isaaclab.sh --format` - [x] I have made corresponding changes to the documentation - [x] My changes generate no new warnings - [x] I have added tests that prove my fix is effective or that my feature works - [x] I have updated the changelog and the corresponding version in the extension's `config/extension.toml` file - [x] I have added my name to the `CONTRIBUTORS.md` or my name already exists there <!-- As you go through the checklist above, you can mark something as done by putting an x character in it For example, - [x] I have done this task - [ ] I have not done this task -->
1 parent 841c992 commit 8504fd3

File tree

21 files changed

+29
-42
lines changed

21 files changed

+29
-42
lines changed

docs/source/how-to/add_own_library.rst

Lines changed: 2 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -1,3 +1,5 @@
1+
.. _how-to-add-library:
2+
13
Adding your own learning library
24
================================
35

docs/source/how-to/import_new_asset.rst

Lines changed: 2 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -307,8 +307,8 @@ of gravity.
307307

308308
.. _instanceable: https://openusd.org/dev/api/_usd__page__scenegraph_instancing.html
309309
.. _documentation: https://docs.isaacsim.omniverse.nvidia.com/latest/isaac_lab_tutorials/tutorial_instanceable_assets.html
310-
.. _MJCF importer: https://docs.isaacsim.omniverse.nvidia.com/latest/robot_setup/import_mjcf.html
311-
.. _URDF importer: https://docs.isaacsim.omniverse.nvidia.com/latest/robot_setup/import_urdf.html
310+
.. _MJCF importer: https://docs.isaacsim.omniverse.nvidia.com/latest/importer_exporter/ext_isaacsim_asset_importer_mjcf.html
311+
.. _URDF importer: https://docs.isaacsim.omniverse.nvidia.com/latest/importer_exporter/ext_isaacsim_asset_importer_urdf.html
312312
.. _anymal.urdf: https://github.com/isaac-orbit/anymal_d_simple_description/blob/master/urdf/anymal.urdf
313313
.. _asset converter: https://docs.omniverse.nvidia.com/extensions/latest/ext_asset-converter.html
314314
.. _mujoco_menagerie: https://github.com/google-deepmind/mujoco_menagerie/tree/main/unitree_h1

docs/source/how-to/master_omniverse.rst

Lines changed: 0 additions & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -119,6 +119,5 @@ Part 3: More Resources
119119

120120
- `Omniverse Glossary of Terms <https://docs.isaacsim.omniverse.nvidia.com/latest/reference_material/reference_glossary.html>`__
121121
- `Omniverse Code Samples <https://docs.omniverse.nvidia.com/dev-guide/latest/programmer_ref.html>`__
122-
- `PhysX Collider Compatibility <https://docs.omniverse.nvidia.com/extensions/latest/ext_physics/rigid-bodies.html#collidercompatibility>`__
123122
- `PhysX Limitations <https://docs.isaacsim.omniverse.nvidia.com/latest/physics/physics_resources.html>`__
124123
- `PhysX Documentation <https://nvidia-omniverse.github.io/PhysX/physx/>`__.

docs/source/overview/developer-guide/vs_code.rst

Lines changed: 1 addition & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -52,8 +52,7 @@ If everything executes correctly, it should create the following files:
5252
For more information on VSCode support for Omniverse, please refer to the
5353
following links:
5454

55-
* `Isaac Sim VSCode support <https://docs.omniverse.nvidia.com/app_isaacsim/app_isaacsim/manual_standalone_python.html#isaac-sim-python-vscode>`__
56-
* `Debugging with VSCode <https://docs.isaacsim.omniverse.nvidia.com/latest/development_tools/vscode.html#visual-studio-code-vs-code>`__
55+
* `Isaac Sim VSCode support <https://docs.isaacsim.omniverse.nvidia.com/latest/development_tools/vscode.html#visual-studio-code-vs-code>`__
5756

5857

5958
Configuring the python interpreter

docs/source/refs/contributing.rst

Lines changed: 2 additions & 5 deletions
Original file line numberDiff line numberDiff line change
@@ -112,11 +112,8 @@ integrated with the `NVIDIA Omniverse Platform <https://developer.nvidia.com/omn
112112
Since all assets are hosted on Nucleus, we do not need to include them in the repository. However,
113113
we need to include the links to the assets in the documentation.
114114

115-
The included assets are part of the `Isaac Sim Content <https://docs.isaacsim.omniverse.nvidia.com/latest/assets/index.html>`__.
116-
To use this content, you can use the Asset Browser provided in Isaac Sim.
117-
118-
Please check the `Isaac Sim documentation <https://docs.isaacsim.omniverse.nvidia.com/latest/assets/index.html>`__
119-
for more information on how to download the assets.
115+
Please checkout the `Isaac Sim Assets <https://docs.isaacsim.omniverse.nvidia.com/latest/assets/usd_assets_overview.html>`__
116+
for more information on what is presently available.
120117

121118
.. attention::
122119

docs/source/refs/reference_architecture/index.rst

Lines changed: 8 additions & 7 deletions
Original file line numberDiff line numberDiff line change
@@ -195,10 +195,12 @@ Some wrappers include:
195195
* `Video Wrappers <https://isaac-sim.github.io/IsaacLab/main/source/how-to/wrap_rl_env.html#wrapper-for-recording-videos>`__
196196
* `RL Libraries Wrappers <https://isaac-sim.github.io/IsaacLab/main/source/how-to/wrap_rl_env.html#wrapper-for-learning-frameworks>`__
197197

198+
.. currentmodule:: isaaclab_rl
199+
198200
Most RL libraries expect their own variation of an environment interface. This means the
199201
data types needed by each library differs. Isaac Lab provides its own wrappers to convert
200202
the environment into the expected interface by the RL library a user wants to use. These are
201-
specified in the `Isaac Lab utils wrapper module <https://isaac-sim.github.io/IsaacLab/main/source/api/lab_tasks/isaaclab_rl.html#module-isaaclab_rl>`__.
203+
specified in :class:`isaaclab_rl`
202204

203205
See the `full list <https://gymnasium.farama.org/api/wrappers/#gymnasium.Wrapper>`__ of other wrappers APIs. For more information on how these wrappers work,
204206
please refer to the `Wrapping environments <https://isaac-sim.github.io/IsaacLab/main/source/how-to/wrap_rl_env.html#how-to-env-wrappers>`__ documentation.
@@ -345,7 +347,7 @@ Check out our resources on using Isaac Lab with your robots.
345347

346348
Review Our Documentation & Samples Resources
347349

348-
* `Isaac Lab Tutorials`_
350+
* :ref:`Isaac Lab Tutorials <tutorials>`
349351
* `Fast-Track Robot Learning in Simulation Using NVIDIA Isaac Lab`_
350352
* `Supercharge Robotics Workflows with AI and Simulation Using NVIDIA Isaac Sim 4.0 and NVIDIA Isaac Lab`_
351353
* `Closing the Sim-to-Real Gap: Training Spot Quadruped Locomotion with NVIDIA Isaac Lab <https://developer.nvidia.com/blog/closing-the-sim-to-real-gap-training-spot-quadruped-locomotion-with-nvidia-isaac-lab/>`__
@@ -360,16 +362,15 @@ Learn More About Featured NVIDIA Solutions
360362

361363
.. _curriculum learning: https://arxiv.org/abs/2109.11978
362364
.. _CAD Converter: https://docs.omniverse.nvidia.com/extensions/latest/ext_cad-converter.html
363-
.. _URDF Importer: https://docs.isaacsim.omniverse.nvidia.com/latest/robot_setup/ext_isaacsim_asset_importer_urdf.html
364-
.. _MJCF Importer: https://docs.isaacsim.omniverse.nvidia.com/latest/robot_setup/ext_isaacsim_asset_importer_mjcf.html
365+
.. _URDF Importer: https://docs.isaacsim.omniverse.nvidia.com/latest/importer_exporter/ext_isaacsim_asset_importer_urdf.html
366+
.. _MJCF Importer: https://docs.isaacsim.omniverse.nvidia.com/latest/importer_exporter/ext_isaacsim_asset_importer_mjcf.html
365367
.. _Onshape Importer: https://docs.omniverse.nvidia.com/extensions/latest/ext_onshape.html
366-
.. _Isaac Sim Reference Architecture: https://docs.isaacsim.omniverse.nvidia.com/latest/isaac_sim_reference_architecture.html
367-
.. _Importing Assets section: https://docs.isaacsim.omniverse.nvidia.com/latest/isaac_sim_reference_architecture.html#importing-assets
368+
.. _Isaac Sim Reference Architecture: https://docs.isaacsim.omniverse.nvidia.com/latest/introduction/reference_architecture.html
369+
.. _Importing Assets section: https://docs.isaacsim.omniverse.nvidia.com/latest/importer_exporter/importers_exporters.html
368370

369371
.. _Scale AI-Enabled Robotics Development Workloads with NVIDIA OSMO: https://developer.nvidia.com/blog/scale-ai-enabled-robotics-development-workloads-with-nvidia-osmo/
370372
.. _Isaac Perceptor: https://developer.nvidia.com/isaac/perceptor
371373
.. _Isaac Manipulator: https://developer.nvidia.com/isaac/manipulator
372374
.. _Additional Resources: https://isaac-sim.github.io/IsaacLab/main/source/refs/additional_resources.html
373-
.. _Isaac Lab Tutorials: file:///home/oomotuyi/isaac/IsaacLab/docs/_build/current/source/tutorials/index.html
374375
.. _Fast-Track Robot Learning in Simulation Using NVIDIA Isaac Lab: https://developer.nvidia.com/blog/fast-track-robot-learning-in-simulation-using-nvidia-isaac-lab/
375376
.. _Supercharge Robotics Workflows with AI and Simulation Using NVIDIA Isaac Sim 4.0 and NVIDIA Isaac Lab: https://developer.nvidia.com/blog/supercharge-robotics-workflows-with-ai-and-simulation-using-nvidia-isaac-sim-4-0-and-nvidia-isaac-lab/

docs/source/refs/release_notes.rst

Lines changed: 2 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -1361,12 +1361,12 @@ New Features
13611361

13621362
* Integrated CI/CD pipeline, which is triggered on pull requests and publishes the results publicly
13631363
* Extended support for Windows OS platforms
1364-
* Added `tiled rendered <https://isaac-sim.github.io/IsaacLab/source/features/tiled_rendering.html>`_ based Camera
1364+
* Added tiled render based Camera
13651365
sensor implementation. This provides optimized RGB-D rendering throughputs of up to 10k frames per second.
13661366
* Added support for multi-GPU and multi-node training for the RL-Games library
13671367
* Integrated APIs for environment designing (direct workflow) without relying on managers
13681368
* Added implementation of delayed PD actuator model
1369-
* `Added various new learning environments <https://isaac-sim.github.io/IsaacLab/main/source/features/environments.html>`_:
1369+
* Added various new learning environments:
13701370
* Cartpole balancing using images
13711371
* Shadow hand cube reorientation
13721372
* Boston Dynamics Spot locomotion

docs/source/tutorials/00_sim/launch_app.rst

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -172,5 +172,5 @@ want our simulation to be more performant. The process can be killed by pressing
172172
terminal.
173173

174174

175-
.. _specification: https://docs.omniverse.nvidia.com/py/isaacsim/source/isaacsim.simulation_app/docs/index.html#isaacsim.simulation_app.SimulationApp.DEFAULT_LAUNCHER_CONFIG
175+
.. _specification: https://docs.isaacsim.omniverse.nvidia.com/latest/py/source/extensions/isaacsim.simulation_app/docs/index.html#isaacsim.simulation_app.SimulationApp.DEFAULT_LAUNCHER_CONFIG
176176
.. _WebRTC Livestreaming: https://docs.isaacsim.omniverse.nvidia.com/latest/installation/manual_livestream_clients.html#isaac-sim-short-webrtc-streaming-client

docs/source/tutorials/01_assets/add_new_robot.rst

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -6,7 +6,7 @@ Adding a New Robot to Isaac Lab
66
.. currentmodule:: isaaclab
77

88
Simulating and training a new robot is a multi-step process that starts with importing the robot into Isaac Sim.
9-
This is covered in depth in the Isaac Sim documentation `here <https://docs.isaacsim.omniverse.nvidia.com/latest/robot_setup/importers_exporters.html>`_.
9+
This is covered in depth in the Isaac Sim documentation `here <https://docs.isaacsim.omniverse.nvidia.com/latest/importer_exporter/importers_exporters.html>`_.
1010
Once the robot is imported and tuned for simulation, we must define those interfaces necessary to clone the robot across multiple environments, drive its joints,
1111
and properly reset it, regardless of the chosen workflow or training framework.
1212

source/isaaclab/isaaclab/app/app_launcher.py

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -76,7 +76,7 @@ def __init__(self, launcher_args: argparse.Namespace | dict | None = None, **kwa
7676
such as ``LIVESTREAM``.
7777
7878
.. _argparse.Namespace: https://docs.python.org/3/library/argparse.html?highlight=namespace#argparse.Namespace
79-
.. _SimulationApp: https://docs.omniverse.nvidia.com/py/isaacsim/source/isaacsim.simulation_app/docs/index.html
79+
.. _SimulationApp: https://docs.isaacsim.omniverse.nvidia.com/latest/py/source/extensions/isaacsim.simulation_app/docs/index.html#isaacsim.simulation_app.SimulationApp
8080
"""
8181
# We allow users to pass either a dict or an argparse.Namespace into
8282
# __init__, anticipating that these will be all of the argparse arguments

0 commit comments

Comments
 (0)