Skip to content

Commit

Permalink
1.17.2
Browse files Browse the repository at this point in the history
  • Loading branch information
mikeferguson committed Jun 20, 2022
1 parent 48c07bc commit 47c9c62
Show file tree
Hide file tree
Showing 32 changed files with 48 additions and 48 deletions.
4 changes: 2 additions & 2 deletions amcl/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package amcl
^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
1.17.2 (2022-06-20)
-------------------
* Update pf.c (`#1161 <https://github.com/ros-planning/navigation/issues/1161>`_)
`#1160 <https://github.com/ros-planning/navigation/issues/1160>`_ AMCL miscalculates orientation covariance for clusters
* Improved Overall readablity (`#1177 <https://github.com/ros-planning/navigation/issues/1177>`_)
Expand Down
2 changes: 1 addition & 1 deletion amcl/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
<?xml-model href="http://download.ros.org/schema/package_format2.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="2">
<name>amcl</name>
<version>1.17.1</version>
<version>1.17.2</version>
<description>
<p>
amcl is a probabilistic localization system for a robot moving in
Expand Down
4 changes: 2 additions & 2 deletions base_local_planner/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package base_local_planner
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
1.17.2 (2022-06-20)
-------------------
* Commit 89a8593 removed footprint scaling. This brings it back. (`#886 <https://github.com/ros-planning/navigation/issues/886>`_) (`#1204 <https://github.com/ros-planning/navigation/issues/1204>`_)
Co-authored-by: Frank Höller <[email protected]>
* Contributors: Michael Ferguson
Expand Down
2 changes: 1 addition & 1 deletion base_local_planner/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
<?xml-model href="http://download.ros.org/schema/package_format2.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="2">
<name>base_local_planner</name>
<version>1.17.1</version>
<version>1.17.2</version>
<description>

This package provides implementations of the Trajectory Rollout and Dynamic Window approaches to local robot navigation on a plane. Given a plan to follow and a costmap, the controller produces velocity commands to send to a mobile base. This package supports both holonomic and non-holonomic robots, any robot footprint that can be represented as a convex polygon or circle, and exposes its configuration as ROS parameters that can be set in a launch file. This package's ROS wrapper adheres to the BaseLocalPlanner interface specified in the <a href="http://wiki.ros.org/nav_core">nav_core</a> package.
Expand Down
4 changes: 2 additions & 2 deletions carrot_planner/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package carrot_planner
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
1.17.2 (2022-06-20)
-------------------
* Fix carrot planner (`#1056 <https://github.com/ros-planning/navigation/issues/1056>`_)
* fix memory leak of world_model\_
* fix uninitialized raw pointers
Expand Down
2 changes: 1 addition & 1 deletion carrot_planner/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
<?xml-model href="http://download.ros.org/schema/package_format2.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="2">
<name>carrot_planner</name>
<version>1.17.1</version>
<version>1.17.2</version>
<description>

This planner attempts to find a legal place to put a carrot for the robot to follow. It does this by moving back along the vector between the robot and the goal point.
Expand Down
4 changes: 2 additions & 2 deletions clear_costmap_recovery/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package clear_costmap_recovery
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
1.17.2 (2022-06-20)
-------------------
* check if the layer is derived from costmap_2d::CostmapLayer (`#1054 <https://github.com/ros-planning/navigation/issues/1054>`_)
Co-authored-by: Dima Dorezyuk <[email protected]>
* Add invert_area_to_clear to clear costmap recovery behavior (`#1030 <https://github.com/ros-planning/navigation/issues/1030>`_)
Expand Down
2 changes: 1 addition & 1 deletion clear_costmap_recovery/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
<?xml-model href="http://download.ros.org/schema/package_format2.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="2">
<name>clear_costmap_recovery</name>
<version>1.17.1</version>
<version>1.17.2</version>
<description>

This package provides a recovery behavior for the navigation stack that attempts to clear space by reverting the costmaps used by the navigation stack to the static map outside of a given area.
Expand Down
4 changes: 2 additions & 2 deletions costmap_2d/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package costmap_2d
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
1.17.2 (2022-06-20)
-------------------
* Removed unused variables in costmap_2d_ros (`#1126 <https://github.com/ros-planning/navigation/issues/1126>`_)
remove unused `robot_stopped\_`, `old_pose\_` and `timer\_`
* Check if stamp of transformed pose is non-zero (`#1200 <https://github.com/ros-planning/navigation/issues/1200>`_)
Expand Down
2 changes: 1 addition & 1 deletion costmap_2d/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
<?xml-model href="http://download.ros.org/schema/package_format2.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="2">
<name>costmap_2d</name>
<version>1.17.1</version>
<version>1.17.2</version>
<description>
This package provides an implementation of a 2D costmap that takes in sensor
data from the world, builds a 2D or 3D occupancy grid of the data (depending
Expand Down
4 changes: 2 additions & 2 deletions dwa_local_planner/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package dwa_local_planner
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
1.17.2 (2022-06-20)
-------------------

1.17.1 (2020-08-27)
-------------------
Expand Down
2 changes: 1 addition & 1 deletion dwa_local_planner/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
<?xml-model href="http://download.ros.org/schema/package_format2.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="2">
<name>dwa_local_planner</name>
<version>1.17.1</version>
<version>1.17.2</version>
<description>

This package provides an implementation of the Dynamic Window Approach to
Expand Down
4 changes: 2 additions & 2 deletions fake_localization/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package fake_localization
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
1.17.2 (2022-06-20)
-------------------

1.17.1 (2020-08-27)
-------------------
Expand Down
2 changes: 1 addition & 1 deletion fake_localization/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
<?xml-model href="http://download.ros.org/schema/package_format2.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="2">
<name>fake_localization</name>
<version>1.17.1</version>
<version>1.17.2</version>
<description>A ROS node that simply forwards odometry information.</description>
<author>Ioan A. Sucan</author>
<author>[email protected]</author>
Expand Down
4 changes: 2 additions & 2 deletions global_planner/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package global_planner
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
1.17.2 (2022-06-20)
-------------------
* Throttled failed to get plan error to 5 seconds (`#1102 <https://github.com/ros-planning/navigation/issues/1102>`_)
* Fixed the risk of divide by zero. (`#1099 <https://github.com/ros-planning/navigation/issues/1099>`_)
* No virtual destructor polyformic classes fixed. (`#1100 <https://github.com/ros-planning/navigation/issues/1100>`_)
Expand Down
2 changes: 1 addition & 1 deletion global_planner/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
<?xml-model href="http://download.ros.org/schema/package_format2.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="2">
<name>global_planner</name>
<version>1.17.1</version>
<version>1.17.2</version>
<description>
A path planner library and node.
</description>
Expand Down
4 changes: 2 additions & 2 deletions map_server/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package map_server
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
1.17.2 (2022-06-20)
-------------------
* Change_map service to map_server [Rebase/Noetic] (`#1029 <https://github.com/ros-planning/navigation/issues/1029>`_)
* Refactored map loading from constructor to three methods
* Added change_map service using LoadMap.srv
Expand Down
2 changes: 1 addition & 1 deletion map_server/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
<?xml-model href="http://download.ros.org/schema/package_format2.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="2">
<name>map_server</name>
<version>1.17.1</version>
<version>1.17.2</version>
<description>

map_server provides the <tt>map_server</tt> ROS <a href="http://www.ros.org/wiki/Nodes">Node</a>, which offers map data as a ROS <a href="http://www.ros.org/wiki/Services">Service</a>. It also provides the <tt>map_saver</tt> command-line utility, which allows dynamically generated maps to be saved to file.
Expand Down
4 changes: 2 additions & 2 deletions move_base/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package move_base
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
1.17.2 (2022-06-20)
-------------------
* Check if stamp of transformed pose is non-zero (`#1200 <https://github.com/ros-planning/navigation/issues/1200>`_)
* Create move_base catkin library (`#1116 <https://github.com/ros-planning/navigation/issues/1116>`_)
Co-authored-by: vkotaru <[email protected]>
Expand Down
2 changes: 1 addition & 1 deletion move_base/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
<?xml-model href="http://download.ros.org/schema/package_format2.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="2">
<name>move_base</name>
<version>1.17.1</version>
<version>1.17.2</version>
<description>

The move_base package provides an implementation of an action (see the <a href="http://www.ros.org/wiki/actionlib">actionlib</a> package) that, given a goal in the world, will attempt to reach it with a mobile base. The move_base node links together a global and local planner to accomplish its global navigation task. It supports any global planner adhering to the nav_core::BaseGlobalPlanner interface specified in the <a href="http://www.ros.org/wiki/nav_core">nav_core</a> package and any local planner adhering to the nav_core::BaseLocalPlanner interface specified in the <a href="http://www.ros.org/wiki/nav_core">nav_core</a> package. The move_base node also maintains two costmaps, one for the global planner, and one for a local planner (see the <a href="http://www.ros.org/wiki/costmap_2d">costmap_2d</a> package) that are used to accomplish navigation tasks.
Expand Down
4 changes: 2 additions & 2 deletions move_slow_and_clear/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package move_slow_and_clear
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
1.17.2 (2022-06-20)
-------------------
* [move_slow_and_clear] Add rosparam representing max vel rosparam name (`#1039 <https://github.com/ros-planning/navigation/issues/1039>`_)
* Contributors: Naoya Yamaguchi

Expand Down
2 changes: 1 addition & 1 deletion move_slow_and_clear/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
<?xml-model href="http://download.ros.org/schema/package_format2.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="2">
<name>move_slow_and_clear</name>
<version>1.17.1</version>
<version>1.17.2</version>
<description>

move_slow_and_clear
Expand Down
4 changes: 2 additions & 2 deletions nav_core/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package nav_core
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
1.17.2 (2022-06-20)
-------------------

1.17.1 (2020-08-27)
-------------------
Expand Down
2 changes: 1 addition & 1 deletion nav_core/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
<?xml-model href="http://download.ros.org/schema/package_format2.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="2">
<name>nav_core</name>
<version>1.17.1</version>
<version>1.17.2</version>
<description>

This package provides common interfaces for navigation specific robot actions. Currently, this package provides the BaseGlobalPlanner, BaseLocalPlanner, and RecoveryBehavior interfaces, which can be used to build actions that can easily swap their planner, local controller, or recovery behavior for new versions adhering to the same interface.
Expand Down
4 changes: 2 additions & 2 deletions navfn/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package navfn
^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
1.17.2 (2022-06-20)
-------------------
* navfn: stop installing test headers (`#1085 <https://github.com/ros-planning/navigation/issues/1085>`_)
The navtest executable is only built if FLTK is installed. However, the
header it uses is installed regardless, and requires FLTK. Nothing else
Expand Down
2 changes: 1 addition & 1 deletion navfn/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
<?xml-model href="http://download.ros.org/schema/package_format2.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="2">
<name>navfn</name>
<version>1.17.1</version>
<version>1.17.2</version>
<description>

navfn provides a fast interpolated navigation function that can be used to create plans for
Expand Down
4 changes: 2 additions & 2 deletions navigation/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package navigation
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
1.17.2 (2022-06-20)
-------------------

1.17.1 (2020-08-27)
-------------------
Expand Down
2 changes: 1 addition & 1 deletion navigation/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
<?xml-model href="http://download.ros.org/schema/package_format2.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="2">
<name>navigation</name>
<version>1.17.1</version>
<version>1.17.2</version>
<description>
A 2D navigation stack that takes in information from odometry, sensor
streams, and a goal pose and outputs safe velocity commands that are sent
Expand Down
4 changes: 2 additions & 2 deletions rotate_recovery/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package rotate_recovery
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
1.17.2 (2022-06-20)
-------------------

1.17.1 (2020-08-27)
-------------------
Expand Down
2 changes: 1 addition & 1 deletion rotate_recovery/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
<?xml-model href="http://download.ros.org/schema/package_format2.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="2">
<name>rotate_recovery</name>
<version>1.17.1</version>
<version>1.17.2</version>
<description>

This package provides a recovery behavior for the navigation stack that attempts to clear space by performing a 360 degree rotation of the robot.
Expand Down
4 changes: 2 additions & 2 deletions voxel_grid/CHANGELOG.rst
Original file line number Diff line number Diff line change
Expand Up @@ -2,8 +2,8 @@
Changelog for package voxel_grid
^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^^

Forthcoming
-----------
1.17.2 (2022-06-20)
-------------------

1.17.1 (2020-08-27)
-------------------
Expand Down
2 changes: 1 addition & 1 deletion voxel_grid/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@
<?xml-model href="http://download.ros.org/schema/package_format2.xsd" schematypens="http://www.w3.org/2001/XMLSchema"?>
<package format="2">
<name>voxel_grid</name>
<version>1.17.1</version>
<version>1.17.2</version>
<description>

voxel_grid provides an implementation of an efficient 3D voxel grid. The occupancy grid can support 3 different representations for the state of a cell: marked, free, or unknown. Due to the underlying implementation relying on bitwise and and or integer operations, the voxel grid only supports 16 different levels per voxel column. However, this limitation yields raytracing and cell marking performance in the grid comparable to standard 2D structures making it quite fast compared to most 3D structures.
Expand Down

0 comments on commit 47c9c62

Please sign in to comment.