Skip to content

Commit

Permalink
Fix up some warnings when building the documentation. (#4261) (#4263)
Browse files Browse the repository at this point in the history
* We don't need a redirect for a new page.
* We don't need an anchor for a new page.
* The length of the underline should match the text above.
* italics are done with double `` in rst, not single.

Signed-off-by: Chris Lalancette <[email protected]>
(cherry picked from commit a567e19)

Co-authored-by: Chris Lalancette <[email protected]>
  • Loading branch information
mergify[bot] and clalancette authored Apr 4, 2024
1 parent e334b80 commit 20c08f1
Show file tree
Hide file tree
Showing 2 changed files with 3 additions and 9 deletions.
4 changes: 2 additions & 2 deletions source/Releases/Release-Jazzy-Jalisco.rst
Original file line number Diff line number Diff line change
Expand Up @@ -78,8 +78,8 @@ In Humble, the headers: ``tf2_bullet/tf2_bullet.h``, ``tf2_eigen/tf2_eigen.h``,
In Jazzy, the ``tf2_bullet/tf2_bullet.h``, ``tf2_eigen/tf2_eigen.h``, ``tf2_geometry_msgs/tf2_geometry_msgs.h``,
``tf2_kdl/tf2_kdl.h``, ``tf2_sensor_msgs/tf2_sensor_msgs.h`` headers have been completely removed.

Return types of `wait_for_transform_async` and `wait_for_transform_full_async` changed
""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""
Return types of ``wait_for_transform_async`` and ``wait_for_transform_full_async`` changed
""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""""
Previously ``wait_for_transform_async`` and ``wait_for_transform_full_async`` of the ``Buffer`` class returned a future containing true or false
In Jazzy, the future will contain the information of the transform being waited on.

Expand Down
Original file line number Diff line number Diff line change
@@ -1,11 +1,5 @@
.. redirect-from::

Tutorials/URDF/Exporting-an-URDF-file

.. _URDFXacro:

Generating an URDF File
=================================
=======================

**Goal:** Learn how to Export and URDF File

Expand Down

0 comments on commit 20c08f1

Please sign in to comment.