Skip to content

Commit df21352

Browse files
authored
Add particle filter msgs to migration guide (ros-navigation#12)
1 parent 10eb656 commit df21352

File tree

1 file changed

+12
-0
lines changed

1 file changed

+12
-0
lines changed

migration/Eloquent.rst

Lines changed: 12 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -58,3 +58,15 @@ Map Server now has new ``map_io`` dynamic library. All functions saving/loading
5858
``map_loader`` was completely removed from ``nav2_util``. All its functionality already present in ``map_io``. Please use it in your code instead.
5959

6060
Please refer to the `original GitHub ticket <https://github.com/ros-planning/navigation2/issues/1010>`_ and `Map Server README <https://github.com/ros-planning/navigation2/blob/master/nav2_map_server/README.md>`_ for more information.
61+
62+
63+
New Particle Filter Messages
64+
****************************
65+
66+
New particle filter messages for particle clouds were added to include the particle weights along with their poses.
67+
``nav2_msgs/Particle`` defines a single particle with a pose and a weight in a particle cloud.
68+
``nav2_msgs/ParticleCloud`` defines a set of particles, each with a pose and a weight.
69+
70+
``AMCL`` now publishes the its particle cloud as a ``nav2_msgs/ParticleCloud`` instead of a ``geometry_msgs/PoseArray``.
71+
72+
`See here for more information. <https://github.com/ros-planning/navigation2/pull/1677>`_

0 commit comments

Comments
 (0)