Skip to content

Commit

Permalink
[skip ci] publish latest
Browse files Browse the repository at this point in the history
Signed-off-by: navigation2-ci <[email protected]>
  • Loading branch information
navigation2-ci committed Jul 22, 2024
1 parent 1640cc6 commit 2ccc57c
Show file tree
Hide file tree
Showing 3 changed files with 16 additions and 24 deletions.
3 changes: 0 additions & 3 deletions _sources/commander_api/index.rst.txt
Original file line number Diff line number Diff line change
Expand Up @@ -102,9 +102,6 @@ New as of September 2023: the simple navigator constructor will accept a `namesp
| getPathThroughPoses(start, goals, | Gets a path through a starting to a set of goals, a list |
| planner_id='', use_start=False) | of ``PoseStamped``, ``nav_msgs/Path``. |
+---------------------------------------+----------------------------------------------------------------------------+
| getRoute(start, goal, | Gets a sparse route and dense path from start to goal, where start and |
| use_start=False) | goal may be of type ``PoseStamped`` or ``int`` for known NodeIDs. |
+---------------------------------------+----------------------------------------------------------------------------+
| dockRobot(dock_pose, dock_type) | Attempts to dock the robot at a given docking pose and type, without using |
| | docking database of known docks. |
+---------------------------------------+----------------------------------------------------------------------------+
Expand Down
35 changes: 15 additions & 20 deletions commander_api/index.html
Original file line number Diff line number Diff line change
Expand Up @@ -1198,67 +1198,62 @@ <h2>Commander API<a class="headerlink" href="#id1" title="Permalink to this head
<td><p>Gets a path through a starting to a set of goals, a list
of <code class="docutils literal notranslate"><span class="pre">PoseStamped</span></code>, <code class="docutils literal notranslate"><span class="pre">nav_msgs/Path</span></code>.</p></td>
</tr>
<tr class="row-odd"><td><p>getRoute(start, goal,
use_start=False)</p></td>
<td><p>Gets a sparse route and dense path from start to goal, where start and
goal may be of type <code class="docutils literal notranslate"><span class="pre">PoseStamped</span></code> or <code class="docutils literal notranslate"><span class="pre">int</span></code> for known NodeIDs.</p></td>
</tr>
<tr class="row-even"><td><p>dockRobot(dock_pose, dock_type)</p></td>
<tr class="row-odd"><td><p>dockRobot(dock_pose, dock_type)</p></td>
<td><p>Attempts to dock the robot at a given docking pose and type, without using
docking database of known docks.</p></td>
</tr>
<tr class="row-odd"><td><p>dockRobot(dock_id)</p></td>
<tr class="row-even"><td><p>dockRobot(dock_id)</p></td>
<td><p>Attempts to dock the robot at a given dock ID in the database of known
docks.</p></td>
</tr>
<tr class="row-even"><td><p>undockRobot(dock_type=”“)</p></td>
<tr class="row-odd"><td><p>undockRobot(dock_type=”“)</p></td>
<td><p>Undocks robot. If docking server instance was used to dock, type is not
required.</p></td>
</tr>
<tr class="row-odd"><td><p>getandTrackRoute(start, goal,
<tr class="row-even"><td><p>getandTrackRoute(start, goal,
use_start=False)</p></td>
<td><p>Gets and tracks a sparse route and dense path from start to goal, where
start &amp; goal may be of type <code class="docutils literal notranslate"><span class="pre">PoseStamped</span></code> or <code class="docutils literal notranslate"><span class="pre">int</span></code> for known NodeIDs.</p></td>
</tr>
<tr class="row-even"><td><p>smoothPath(path, smoother_id=’‘,
<tr class="row-odd"><td><p>smoothPath(path, smoother_id=’‘,
max_duration=2.0,
check_for_collision=False)</p></td>
<td><p>Smooths a given path of type <code class="docutils literal notranslate"><span class="pre">nav_msgs/Path</span></code>.</p></td>
</tr>
<tr class="row-odd"><td><p>changeMap(map_filepath)</p></td>
<tr class="row-even"><td><p>changeMap(map_filepath)</p></td>
<td><p>Requests a change from the current map to <cite>map_filepath</cite>’s yaml.</p></td>
</tr>
<tr class="row-even"><td><p>clearAllCostmaps()</p></td>
<tr class="row-odd"><td><p>clearAllCostmaps()</p></td>
<td><p>Clears both the global and local costmaps.</p></td>
</tr>
<tr class="row-odd"><td><p>clearLocalCostmap()</p></td>
<tr class="row-even"><td><p>clearLocalCostmap()</p></td>
<td><p>Clears the local costmap.</p></td>
</tr>
<tr class="row-even"><td><p>clearGlobalCostmap()</p></td>
<tr class="row-odd"><td><p>clearGlobalCostmap()</p></td>
<td><p>Clears the global costmap.</p></td>
</tr>
<tr class="row-odd"><td><p>getGlobalCostmap()</p></td>
<tr class="row-even"><td><p>getGlobalCostmap()</p></td>
<td><p>Returns the global costmap, <code class="docutils literal notranslate"><span class="pre">nav2_msgs/Costmap</span></code>.</p></td>
</tr>
<tr class="row-even"><td><p>getLocalCostmap()</p></td>
<tr class="row-odd"><td><p>getLocalCostmap()</p></td>
<td><p>Returns the local costmap, <code class="docutils literal notranslate"><span class="pre">nav2_msgs/Costmap</span></code>.</p></td>
</tr>
<tr class="row-odd"><td><p>waitUntilNav2Active(
<tr class="row-even"><td><p>waitUntilNav2Active(
navigator=’bt_navigator’,
localizer=’amcl’)</p></td>
<td><p>Blocks until Nav2 is completely online and lifecycle nodes are in the
active state. To be used in conjunction with autostart or external
lifecycle bringup. Custom navigator and localizer nodes can be specified</p></td>
</tr>
<tr class="row-even"><td><p>lifecycleStartup()</p></td>
<tr class="row-odd"><td><p>lifecycleStartup()</p></td>
<td><p>Sends a request to all lifecycle management servers to bring them into
the active state, to be used if autostart is <code class="docutils literal notranslate"><span class="pre">False</span></code> and you want this
program to control Nav2’s lifecycle.</p></td>
</tr>
<tr class="row-odd"><td><p>lifecycleShutdown()</p></td>
<tr class="row-even"><td><p>lifecycleShutdown()</p></td>
<td><p>Sends a request to all lifecycle management servers to shut them down.</p></td>
</tr>
<tr class="row-even"><td><p>destroyNode()</p></td>
<tr class="row-odd"><td><p>destroyNode()</p></td>
<td><p>Releases the resources used by the object.</p></td>
</tr>
</tbody>
Expand Down
2 changes: 1 addition & 1 deletion searchindex.js

Large diffs are not rendered by default.

0 comments on commit 2ccc57c

Please sign in to comment.