You signed in with another tab or window. Reload to refresh your session.You signed out in another tab or window. Reload to refresh your session.You switched accounts on another tab or window. Reload to refresh your session.Dismiss alert
* Add slam toolbox as exec dep for nav2_bringup (#1827)
* Add slam toolbox as exec dep
* Added slam toolbox
* Changed version of slam toolbox to foxy-devel
* Added modifications to allow for exec depend of slam toolbox without breaking docker / CI
* reformatted skip keys
* Added tabs to skip key arguments
* Removed commented out code block
* Add unit tests for follow path, compute path to pose, and navigate to pose BT action nodes (#1844)
* Add compute path to pose unit tests
Signed-off-by: Sarthak Mittal <[email protected]>
* Add follow path action unit tests
Signed-off-by: Sarthak Mittal <[email protected]>
* Add navigate to pose action unit tests
Signed-off-by: Sarthak Mittal <[email protected]>
* adding foxy build icons to readme (#1853)
* adding foxy build icons
* adding dividers
* sync master from foxy version updates (#1852)
* sync master from foxy version updates
* syncing foxy and master
* Add unit tests for clear entire costmap and reinitialize global localization BT service nodes (#1845)
* Add clear entire costmap service unit tests
Signed-off-by: Sarthak Mittal <[email protected]>
* Add reinitialize global localization service unit test
Signed-off-by: Sarthak Mittal <[email protected]>
* Temporarily disable dump_params test (#1856)
Signed-off-by: Sarthak Mittal <[email protected]>
* commenting out unused validPointPotential (#1854)
* Adding ROS2 versions to issue template (#1861)
* reload behavior tree before creating RosTopicLogger to prevent nullptr error or no /behavior_tree_log problem (#1849)
Signed-off-by: Daisuke Sato <[email protected]>
* Add citation for IROS paper (#1867)
* Add citation
We'll want to add the DOI once published
* Bump citation section above build status
* Fix line breaks
* Changes RCUTILS_CONSOLE_STDOUT_LINE_BUFFERED to RCUTILS_LOGGING_BUFFERED_STREAM (#1868)
* Added parameters to configure amcl laser scan topic (#1870)
* Added parameters to configure amcl topic
* changed parameter to scan_topic and added to all the configuration files
* added scan_topic amcl param to docs
* Satisfied linter
* Move dwb goal/progress checker plugins to nav2_controller (#1857)
* Move dwb goal/progress checker plugins to nav2_controller
Signed-off-by: Siddarth Gore <[email protected]>
* Move goal/progress checker plugins to nav2_controller
Address review comments
Signed-off-by: Siddarth Gore <[email protected]>
* Move goal/progress checker plugins to nav2_controller
Use new plugin declaration format and doc update
Signed-off-by: Siddarth Gore <[email protected]>
* Update bringup.yaml for new plugins in nav2_controller
Also remove redundent file from dwb_plugins
Signed-off-by: Siddarth Gore <[email protected]>
* Fix doc errors and update remaining yaml files
Signed-off-by: Siddarth Gore <[email protected]>
* Remove mention of goal_checker from dwb docs
Signed-off-by: Siddarth Gore <[email protected]>
* Add .plugin params to doc
Signed-off-by: Siddarth Gore <[email protected]>
* Tests for progress_checker plugin
declare .plugin only if not declared before
Signed-off-by: Siddarth Gore <[email protected]>
* Tweak plugin names/description in doc
Signed-off-by: Siddarth Gore <[email protected]>
* Follow pose (#1859)
* Truncate path finished
Signed-off-by: Francisco Martin Rico <[email protected]>
* Follow Pose finished
Signed-off-by: Francisco Martin Rico <[email protected]>
* Change names. Add test and doc
Signed-off-by: Francisco Martin Rico <[email protected]>
* Change names and check atan2 values
Signed-off-by: Francisco Martin Rico <[email protected]>
* Checking Inf/NaNs and trucate path changes
Signed-off-by: Francisco Martin Rico <[email protected]>
* Revert changes in launcher
Signed-off-by: Francisco Martin Rico <[email protected]>
* Documenting Tree
Signed-off-by: Francisco Martin Rico <[email protected]>
* Update nav2_bt_navigator/README.md
Co-authored-by: Steve Macenski <[email protected]>
* Update nav2_bt_navigator/README.md
Co-authored-by: Steve Macenski <[email protected]>
* Change TruncatePath from decorator to action node
Signed-off-by: Francisco Martin Rico <[email protected]>
* Update nav2_bt_navigator/README.md
Co-authored-by: Steve Macenski <[email protected]>
Co-authored-by: Steve Macenski <[email protected]>
* Remove Deprecated Declaration (#1884)
* Remove deprecated rclcpp::executor::FutureReturnCode::SUCCESS in favor of rclcpp::FutureReturnCode::SUCCESS
Signed-off-by: Hunter L. Allen <[email protected]>
* Update nav2_util/include/nav2_util/service_client.hpp
Co-authored-by: Sarthak Mittal <[email protected]>
Co-authored-by: Sarthak Mittal <[email protected]>
* Added new costmap buffer to resize map safely (#1837)
* Added new costmap buffer to resize map safely
Signed-off-by: Aitor Miguel Blanco <[email protected]>
* Update map if the layer is not being processed.
Signed-off-by: Aitor Miguel Blanco <[email protected]>
* Updated bool name and added buffer initialization
Signed-off-by: Aitor Miguel Blanco <[email protected]>
* Fix dump params tests (#1886)
Signed-off-by: Sarthak Mittal <[email protected]>
* Move definitions in tf_help to separate src cpp file (#1890)
* Move definitions of functions in tf_help to separate src cpp file to avoid multiple definition error
* Fix linting issues
* Make uncrustify happier
* More format fixing
* resolved the simulated motion into its x & y components (#1887)
Signed-off-by: Marwan Taher <[email protected]>
* Fix nav2_bt_navigator cleanup (#1901)
Signed-off-by: Sarthak Mittal <[email protected]>
* Adding some more test coverage (#1903)
* more tests
* removing old cmake
* remove on_errors in specific servers in favor of a general lifecycle warning (#1904)
* remove on_errors in favor of a general lifecycle warning
* adding removed thing
* simply nodes to remove lines (#1907)
* Bunches of random new tests (#1909)
* trying to get A* to work again
* make flake 8 happy
* adding cancel and preempt test
* planner tests use A*
* adding A* note
* test with topic
* Adding failure to navigate test (#1912)
* failures tests
* adding copyrights
* cancel test in recoveries
* Costmap lock while copying data in navfn planner (#1913)
* acquire the costmap lock while copying data in navfn planner
Signed-off-by: Daisuke Sato <[email protected]>
* add costmap lock to dwb local plannger
Signed-off-by: Daisuke Sato <[email protected]>
* Added map_topic parameters to static layer and amcl (#1910)
* see if spin some in cancel will allow result callback (#1914)
* Adding near-complete voxel grid test coverage and more to controller server (#1915)
* remove erraneous handling done by prior
* adding a bunch of voxel unit tests
* retrigger
* adding waypoint follower failure test, voxel layer integration tests, etc (#1916)
* adding waypoint follower failure test
* adding voxel, more logging
* reset -> clear
* minor changes to lower redundent warnings (#1918)
* Costmap plugins declare if not declared for reset capabilities (#1919)
* fixing #1917 on declare if not declared
* fix API
* adding CLI test (#1920)
* More coverage in map server tests (#1921)
* adding CLI test
* adding a bunch of new coverages for map_server
* Add in range sensor costmap layer (#1888)
* range costmap building
* range sensor layer working
* nav2 costmap pass linter and uncrustify tests
* Added back semicolon to range class
* Added docs
* Added angles dependency
* Added BSD license
* Added BSD license
* Made functions inline
* revmoed get_clock
* added input_sensor_type to docs
* Made defualt topic name empty to cause error
* using chorno literal to denote time units
* Added small initial test
* Fixed linter error, line breaks, enum, logger level, and transform_tolerance issue
* fixed segmentation fault in test and added transfrom tolerances to tf_->transform
* Got test to pass
* Added more tests
* removed incorrect parameter declaration
* Improved marking while moving tests and added clearing tests
* removed general clearing test
* changed testing helper import in test
* [Test sprint] push nav2_map_server over 90% (#1922)
* adding CLI test
* adding tests for more lines to map_server
* fix last test
* adding out of bounds and higher bounds checks
* adding planner tests for plugins working
* add cleanup
* working
* ping
* [testing sprint] final test coverage and debug logging in planner/controller servers (#1924)
* adding CLI test
* adding tests for more lines to map_server
* fix last test
* adding out of bounds and higher bounds checks
* adding planner tests for plugins working
* add cleanup
* working
* ping
* adding more testing and debug info messages
* [testing sprint] remove dead code not used in 10 years from navfn (#1926)
* remove dead code not used in 10 years from navfn
* ping
* inverting period to rate
* removing debug statement that could never be triggered by a single non-looping action server
* type change
* adding removed files
* bump to 0.4.2
* add another missing file
* add missing files
* remove some tests
* lint
* removing nav2_bringup from binaries
Co-authored-by: Michael Equi <[email protected]>
Co-authored-by: Sarthak Mittal <[email protected]>
Co-authored-by: Daisuke Sato <[email protected]>
Co-authored-by: Ruffin <[email protected]>
Co-authored-by: Siddarth Gore <[email protected]>
Co-authored-by: Francisco Martín Rico <[email protected]>
Co-authored-by: Hunter L. Allen <[email protected]>
Co-authored-by: Aitor Miguel Blanco <[email protected]>
Co-authored-by: Joe Smallman <[email protected]>
Co-authored-by: Marwan Taher <[email protected]>
| `<static layer>`.map_topic | "" | Name of the map topic to subscribe to (empty means use the map_topic defined by `costmap_2d_ros`) |
81
84
82
85
## inflation_layer plugin
83
86
@@ -114,7 +117,23 @@ When `plugins` parameter is not overridden, the following default plugins are lo
114
117
| `<data source>`.marking | true | Whether source should mark in costmap |
115
118
| `<data source>`.clearing | false | Whether source should raytrace clear in costmap |
116
119
| `<data source>`.obstacle_range | 2.5 | Maximum range to mark obstacles in costmap |
117
-
| `<data source>`.raytrace_range | 3.0 | Maximum range to raytrace clear obstacles from costmap |
120
+
| `<data source>`.raytrace_range | 3.0 | Maximum range to raytrace clear obstacles from costmap |
121
+
122
+
## range_sensor_layer plugin
123
+
124
+
* `<range layer>`: Name corresponding to the `nav2_costmap_2d::RangeSensorLayer` plugin. This name gets defined in `plugin_names`.
125
+
126
+
| Parameter | Default | Description |
127
+
| ----------| --------| ------------|
128
+
| `<range layer>`.enabled | true | Whether it is enabled |
129
+
| `<range layer>`.topics | [""] | Range topics to subscribe to |
130
+
| `<range layer>`.phi | 1.2 | Phi value |
131
+
| `<range layer>`.inflate_cone | 1.0 | Inflate the triangular area covered by the sensor (percentage) |
132
+
| `<range layer>`.no_readings_timeout | 0.0 | No Readings Timeout |
133
+
| `<range layer>`.clear_threshold | 0.2 | Probability below which cells are marked as free |
134
+
| `<range layer>`.mark_threshold | 0.8 | Probability above which cells are marked as occupied |
135
+
| `<range layer>`.clear_on_max_reading | false | Clear on max reading |
136
+
| `<range layer>`.input_sensor_type | ALL | Input sensor type either ALL (automatic selection), VARIABLE (min range != max range), or FIXED (min range == max range) |
118
137
119
138
## voxel_layer plugin
120
139
@@ -154,12 +173,15 @@ When `plugins` parameter is not overridden, the following default plugins are lo
154
173
| Parameter | Default | Description |
155
174
| ----------| --------| ------------|
156
175
| controller_frequency | 20.0 | Frequency to run controller |
176
+
| progress_checker_plugin | "progress_checker" | Plugin used by the controller to check whether the robot has at least covered a set distance/displacement in a set amount of time, thus checking the progress of the robot. |
| min_x_velocity_threshold | 0.0001 | Minimum X velocity to use (m/s) |
159
183
| min_y_velocity_threshold | 0.0001 | Minimum Y velocity to use (m/s) |
160
184
| min_theta_velocity_threshold | 0.0001 | Minimum angular velocity to use (rad/s) |
161
-
| required_movement_radius | 0.5 | Minimum amount a robot must move to be progressing to goal (m) |
162
-
| movement_time_allowance | 10.0 | Maximum amount of time a robot has to move the minimum radius (s) |
163
185
164
186
**NOTE:** When `controller_plugins` parameter is overridden, each plugin namespace defined in the list needs to have a `plugin` parameter defining the type of plugin to be loaded in the namespace.
165
187
@@ -173,11 +195,36 @@ controller_server:
173
195
plugin: "dwb_core::DWBLocalPlanner"
174
196
```
175
197
176
-
When `controller_plugins` parameter is not overridden, the following default plugins are loaded:
198
+
When `controller_plugins`\`progress_checker_plugin`\`goal_checker_plugin` parameters are not overridden, the following default plugins are loaded:
| `<nav2_controller plugin>`.stateful | true | Whether to check for XY position tolerance after rotating to goal orientation in case of minor localization changes |
221
+
222
+
## stopped_goal_checker plugin
223
+
224
+
| Parameter | Default | Description |
225
+
| ----------| --------| ------------|
226
+
| `<nav2_controller plugin>`.rot_stopped_velocity | 0.25 | Velocity below is considered to be stopped at tolerance met (rad/s) |
227
+
| `<nav2_controller plugin>`.trans_stopped_velocity | 0.25 | Velocity below is considered to be stopped at tolerance met (m/s) |
181
228
182
229
# dwb_controller
183
230
@@ -193,7 +240,6 @@ When `controller_plugins` parameter is not overridden, the following default plu
193
240
| `<dwb plugin>`.prune_distance | 1.0 | Distance (m) to prune backward until |
194
241
| `<dwb plugin>`.debug_trajectory_details | false | Publish debug information |
| `<dwb plugin>`.stateful | true | Whether to check for XY position tolerance after rotating to goal orientation in case of minor localization changes |
360
-
361
399
## standard_traj_generator plugin
362
400
363
401
| Parameter | Default | Description |
@@ -375,13 +413,6 @@ When `controller_plugins` parameter is not overridden, the following default plu
375
413
| ----------| --------| ------------|
376
414
| `<dwb plugin>`.sim_time | N/A | Time to simulate ahead by (s) |
377
415
378
-
## stopped_goal_checker plugin
379
-
380
-
| Parameter | Default | Description |
381
-
| ----------| --------| ------------|
382
-
| `<dwb plugin>`.rot_stopped_velocity | 0.25 | Velocity below is considered to be stopped at tolerance met (rad/s) |
383
-
| `<dwb plugin>`.trans_stopped_velocity | 0.25 | Velocity below is considered to be stopped at tolerance met (m/s) |
384
-
385
416
# lifecycle_manager
386
417
387
418
| Parameter | Default | Description |
@@ -547,6 +578,8 @@ When `recovery_plugins` parameter is not overridden, the following default plugi
547
578
| z_rand | 0.5 | Mixture weight for z_rand part of model, sum of all used z weight must be 1. Beam uses all 4, likelihood model uses z_hit and z_rand. |
548
579
| z_short | 0.05 | Mixture weight for z_short part of model, sum of all used z weight must be 1. Beam uses all 4, likelihood model uses z_hit and z_rand. |
549
580
| always_reset_initial_pose | false | Requires that AMCL is provided an initial pose either via topic or initial_pose* parameter (with parameter set_initial_pose: true) when reset. Otherwise, by default AMCL will use the last known pose to initialize |
581
+
| scan_topic | scan | Topic to subscribe to in order to receive the laser scan for localization |
582
+
| map_topic | map | Topic to subscribe to in order to receive the map for localization |
550
583
551
584
---
552
585
@@ -624,6 +657,14 @@ When `recovery_plugins` parameter is not overridden, the following default plugi
624
657
| server_name | N/A | Action server name |
625
658
| server_timeout | 10 | Action server timeout (ms) |
626
659
660
+
### BT Node TruncatePath
661
+
662
+
| Input Port | Default | Description |
663
+
| ---------- | ------- | ----------- |
664
+
| input_path | N/A | Path to be truncated |
665
+
| output_path | N/A | Path truncated |
666
+
| distance | 1.0 | Distance (m) to cut from last pose |
667
+
627
668
## Conditions
628
669
629
670
### BT Node GoalReached
@@ -674,3 +715,10 @@ When `recovery_plugins` parameter is not overridden, the following default plugi
0 commit comments