Skip to content

Commit ae24fed

Browse files
Migrate geometry_msgs/PoseStampedArray to nav_msgs/Goals (#656)
* Migrate bt_plugins to use nav_msg goals. Signed-off-by: Leander Stephen D'Souza <[email protected]> * Edited kilted migration guide to include nav_msg goals. Signed-off-by: Leander Stephen D'Souza <[email protected]> --------- Signed-off-by: Leander Stephen D'Souza <[email protected]>
1 parent 857b45b commit ae24fed

File tree

10 files changed

+61
-61
lines changed

10 files changed

+61
-61
lines changed

configuration/packages/bt-plugins/actions/ComputePathThroughPoses.rst

Lines changed: 5 additions & 5 deletions
Original file line numberDiff line numberDiff line change
@@ -23,11 +23,11 @@ Input Ports
2323

2424
:goals:
2525

26-
===================================== =======
27-
Type Default
28-
------------------------------------- -------
29-
geometry_msgs::msg::PoseStampedArray N/A
30-
===================================== =======
26+
==================== =======
27+
Type Default
28+
-------------------- -------
29+
nav_msgs::msg::Goals N/A
30+
==================== =======
3131

3232
Description
3333
Goal poses. Takes in a blackboard variable, e.g. "{goals}".

configuration/packages/bt-plugins/actions/NavigateThroughPoses.rst

Lines changed: 5 additions & 5 deletions
Original file line numberDiff line numberDiff line change
@@ -12,11 +12,11 @@ Input Ports
1212

1313
:goals:
1414

15-
==================================== =======
16-
Type Default
17-
------------------------------------ -------
18-
geometry_msgs::msg::PoseStampedArray N/A
19-
==================================== =======
15+
==================== =======
16+
Type Default
17+
-------------------- -------
18+
nav_msgs::msg::Goals N/A
19+
==================== =======
2020

2121
Description
2222
Goal poses. Takes in a blackboard variable, e.g. "{goals}".

configuration/packages/bt-plugins/actions/RemoveInCollisionGoals.rst

Lines changed: 5 additions & 5 deletions
Original file line numberDiff line numberDiff line change
@@ -22,11 +22,11 @@ Input Ports
2222

2323
:input_goals:
2424

25-
==================================== =======
26-
Type Default
27-
------------------------------------ -------
28-
geometry_msgs::msg::PoseStampedArray N/A
29-
==================================== =======
25+
==================== =======
26+
Type Default
27+
-------------------- -------
28+
nav_msgs::msg::Goals N/A
29+
==================== =======
3030

3131
Description
3232
A vector of goals to check if in collision

configuration/packages/bt-plugins/actions/RemovePassedGoals.rst

Lines changed: 10 additions & 10 deletions
Original file line numberDiff line numberDiff line change
@@ -33,11 +33,11 @@ Input Ports
3333

3434
:input_goals:
3535

36-
==================================== =======
37-
Type Default
38-
------------------------------------ -------
39-
geometry_msgs::msg::PoseStampedArray N/A
40-
==================================== =======
36+
==================== =======
37+
Type Default
38+
-------------------- -------
39+
nav_msgs::msg::Goals N/A
40+
==================== =======
4141

4242
Description
4343
A vector of goals to check if it passed any in the current iteration.
@@ -47,11 +47,11 @@ Output Ports
4747

4848
:output_goals:
4949

50-
==================================== =======
51-
Type Default
52-
------------------------------------ -------
53-
geometry_msgs::msg::PoseStampedArray N/A
54-
==================================== =======
50+
==================== =======
51+
Type Default
52+
-------------------- -------
53+
nav_msgs::msg::Goals N/A
54+
==================== =======
5555

5656
Description
5757
A vector of goals with goals removed in proximity to the robot

configuration/packages/bt-plugins/conditions/GlobalUpdatedGoal.rst

Lines changed: 5 additions & 5 deletions
Original file line numberDiff line numberDiff line change
@@ -25,11 +25,11 @@ Input Ports
2525

2626
:goals:
2727

28-
==================================== =========
29-
Type Default
30-
------------------------------------ ---------
31-
geometry_msgs::msg::PoseStampedArray "{goals}"
32-
==================================== =========
28+
==================== =========
29+
Type Default
30+
-------------------- ---------
31+
nav_msgs::msg::Goals "{goals}"
32+
==================== =========
3333

3434
Description
3535
Vector of goals to check. Takes in a blackboard variable, "{goals}" if not specified.

configuration/packages/bt-plugins/conditions/GoalUpdated.rst

Lines changed: 5 additions & 5 deletions
Original file line numberDiff line numberDiff line change
@@ -22,11 +22,11 @@ Input Ports
2222

2323
:goals:
2424

25-
==================================== =========
26-
Type Default
27-
------------------------------------ ---------
28-
geometry_msgs::msg::PoseStampedArray "{goals}"
29-
==================================== =========
25+
==================== =========
26+
Type Default
27+
-------------------- ---------
28+
nav_msgs::msg::Goals "{goals}"
29+
==================== =========
3030

3131
Description
3232
Vector of goals to check. Takes in a blackboard variable, "{goals}" if not specified.

configuration/packages/bt-plugins/decorators/GoalUpdatedController.rst

Lines changed: 5 additions & 5 deletions
Original file line numberDiff line numberDiff line change
@@ -21,11 +21,11 @@ Input Ports
2121

2222
:goals:
2323

24-
==================================== =========
25-
Type Default
26-
------------------------------------ ---------
27-
geometry_msgs::msg::PoseStampedArray "{goals}"
28-
==================================== =========
24+
==================== =========
25+
Type Default
26+
-------------------- ---------
27+
nav_msgs::msg::Goals "{goals}"
28+
==================== =========
2929

3030
Description
3131
Vector of goals to check. Takes in a blackboard variable, "{goals}" if not specified.

configuration/packages/bt-plugins/decorators/GoalUpdater.rst

Lines changed: 12 additions & 12 deletions
Original file line numberDiff line numberDiff line change
@@ -46,11 +46,11 @@ Input Ports
4646

4747
:input_goals:
4848

49-
============================== =======
50-
Type Default
51-
------------------------------ -------
52-
geometry_msgs/PoseStampedArray N/A
53-
============================== =======
49+
============== =======
50+
Type Default
51+
-------------- -------
52+
nav_msgs/Goals N/A
53+
============== =======
5454

5555
Description
5656
The original goals poses
@@ -70,13 +70,13 @@ Output Ports
7070
The resulting updated goal. If no goal received by subscription, it will be the input_goal
7171

7272
:output_goals:
73-
74-
============================== =======
75-
Type Default
76-
------------------------------ -------
77-
geometry_msgs/PoseStampedArray N/A
78-
============================== =======
79-
73+
74+
============== =======
75+
Type Default
76+
-------------- -------
77+
nav_msgs/Goals N/A
78+
============== =======
79+
8080
Description
8181
The resulting updated goals. If no goals received by subscription, it will be the input_goals
8282

configuration/packages/bt-plugins/decorators/SpeedController.rst

Lines changed: 5 additions & 5 deletions
Original file line numberDiff line numberDiff line change
@@ -68,11 +68,11 @@ Input Ports
6868

6969
:goals:
7070

71-
==================================== =========
72-
Type Default
73-
------------------------------------ ---------
74-
geometry_msgs::msg::PoseStampedArray "{goals}"
75-
==================================== =========
71+
==================== =========
72+
Type Default
73+
-------------------- ---------
74+
nav_msgs::msg::Goals "{goals}"
75+
==================== =========
7676

7777
Description
7878
Vector of goals to check. Takes in a blackboard variable, "{goals}" if not specified.

migration/Jazzy.rst

Lines changed: 4 additions & 4 deletions
Original file line numberDiff line numberDiff line change
@@ -302,12 +302,12 @@ Example for including ``cloned_multi_tb3_simulation_launch.py`` in another launc
302302
launch_arguments={"robots": "robot1={x: 0.5, y: 0.5, yaw: 1.5707}"}.items(),
303303
)
304304
305-
ComputePathThroughPoses, NavigateThroughPoses and other BT nodes now use PoseStampedArray instead of vector<PoseStamped>
305+
ComputePathThroughPoses, NavigateThroughPoses and other BT nodes now use nav_msgs/Goals instead of vector<PoseStamped>
306306
************************************************************************************************************************
307307
308-
In `PR #262 <https://github.com/ros2/common_interfaces/pull/262>`_ a new message type `PoseStampedArray` was introduced to the `geometry_msgs` package.
309-
In `PR #4791 <https://github.com/ros-navigation/navigation2/pull/4791>`_, most instances of `std::vector<geometry_msgs::msg::PoseStamped>` have been replaced with `geometry_msgs::msg::PoseStampedArray`. Most notably, `NavigateThroughPoses.action` and `ComputePathThroughPoses.action` have been updated to use `PoseStampedArray`.
310-
Since `PoseStampedArray` contains a header, the poses are now accessed via `NavigateThroughPoses.poses.poses` instead of `NavigateThroughPoses.poses` or `ComputePathThroughPoses.goals.poses` instead of `ComputePathThroughPoses.poses`. Please update your code accordingly when using these interfaces.
308+
In `PR #269 <https://github.com/ros2/common_interfaces/pull/269>`_ a new message type `Goals` was introduced to the `nav_msgs` package.
309+
In `PR #4980 <https://github.com/ros-navigation/navigation2/pull/4980>`_, all collections of `PoseStamped` has been migrated to use the `nav_msgs::msg::Goals` message. Most notably, `NavigateThroughPoses.action` and `ComputePathThroughPoses.action` have been updated to use `nav_msgs/Goals`.
310+
Since `nav_msgs/Goals` contains a header, the poses are now accessed via `NavigateThroughPoses.poses.goals` instead of `NavigateThroughPoses.poses` or `ComputePathThroughPoses.goals.goals` instead of `ComputePathThroughPoses.poses`. Please update your code accordingly when using these interfaces.
311311
312312
MPPI controller re-implemented using Eigen library and performance improved by 40-45%
313313
*************************************************************************************

0 commit comments

Comments
 (0)