Skip to content

Tags: CollinNHays/navigation2

Tags

1.0.7

Toggle 1.0.7's commit message

Verified

This commit was created on GitHub.com and signed with GitHub’s verified signature. The key has expired.
Galactic sync 4 (Sept 15) (ros-navigation#2561)

* Adding launch_testing_ros dep on nav2 utils to install (ros-navigation#2450)

* Reduce map saver nodes (ros-navigation#2454)

* reduce MapSaver nodes by using callback group/executor combo

Signed-off-by: zhenpeng ge <[email protected]>

* set use_rclcpp_node false

* a cleaner solution using a future and spin_until_future_complete()

Signed-off-by: zhenpeng ge <[email protected]>

* Update nav2_controller.cpp (ros-navigation#2462)

Add `costmap_thread_.reset()` on the destructor of ControllerServer class

* Reduce lifecycle manager nodes (ros-navigation#2456)

* remove bond_client_node_ in class LifecycleManager

Signed-off-by: zhenpeng ge <[email protected]>

* clear unused variables

Signed-off-by: zhenpeng ge <[email protected]>

* fix lint

Signed-off-by: zhenpeng ge <[email protected]>

* use dedicated executor thread

Signed-off-by: William Woodall <[email protected]>

* fix building error

Signed-off-by: zhenpeng ge <[email protected]>

* support to process executor for NodeThread

Signed-off-by: zhenpeng ge <[email protected]>

* use  NodeThread for LifecycleManager

Signed-off-by: zhenpeng ge <[email protected]>

Co-authored-by: William Woodall <[email protected]>

* sync with main and use ros_diff_drive in case name changes (ros-navigation#2472)

Co-authored-by: YOUSSEF LAHROUNI <[email protected]>

* Nav2 Simple (Python3) Commander Library (ros-navigation#2411)

* adding nav2_python_commander package

* adding readme

* launch files for the python commander examples

* renaming to nav2_simple_commander

* resolve review comments

* fixing rosdep key

* fixing up linters

* Python string format (ros-navigation#2466)

* Convert to python format strings for readability

* Merge concatenated strings

* Revert converting generated files

* Single quotes for consistency

* Just print the exception

* Fix Smac cleanup (ros-navigation#2477)

* fix smac2d cleanup

* same for hybrid

* Naming BT client node after action name (ros-navigation#2470)

* Put action name in node namespace instead of node name

* Put namespace remapping in node options

* Rename client node with action name replacing "/" by "_"

* Code formatting

* Code formatting

* fix nav2 params and launch file to publish Local and global costmaps in multi robots example (ros-navigation#2471)

* adjust launch file with needed gazebo plugin and set groot to False for multi-robot params

* correct unwanted changes

* change port and set groot to false

* fix lints

Co-authored-by: YOUSSEF LAHROUNI <[email protected]>

* [SmacPlanner2D] make tolerance parameter dynamic (ros-navigation#2475)

* make tolerance dyn param

* full reconfigure

* fix typo

* Place function above the variables

* lock param callback

* Modify the BtServiceNode to include an on_success call. (ros-navigation#2481)

* Modify the BtServiceNode to include an on_success call.

* PR: Fix linter error by removing trailing whitespaces.

* PR: Rename on_success() to on_completion() to improve understandability.

* Accept path of length 1 (ros-navigation#2495)

* Fix null pointer in amcl on_cleanup (ros-navigation#2503)

* fix data race: addPlugin() and resizeMap() can be executed concurrently (ros-navigation#2512)

Co-authored-by: Kai-Tao Xie <[email protected]>

* fix data race: VoxelLayer::matchSize may be executed concurrently (ros-navigation#2513)

Co-authored-by: Kai-Tao Xie <[email protected]>

* catch runtime_error if the message from laser is malformed (ros-navigation#2511)

* catch runtime_error if the message from laser is malformed

* fix styling

Co-authored-by: Kai-Tao Xie <[email protected]>

* Smac planner bad alloc (ros-navigation#2516)

* test(nav2_smac_planner): show short path bad_alloc

When given a goal that is one or zero costmap
cells away, AStarAlgorithm throws std::bad_alloc

* fix(nav2_smac_planner): fixed bad_alloc

* [ObstacleLayer] Use message_filter timeout (ros-navigation#2518)

* , tf2::durationFromSec(transform_tolerance)

* use message_filter timeout in AMCL

* also for sensor_msgs::msg::PointCloud2

* fix possible use-after-free: unsafe shared_ptr in multithread (ros-navigation#2510)

Co-authored-by: Kai-Tao Xie <[email protected]>

* fix export dependency and library (ros-navigation#2521)

Signed-off-by: zhenpeng ge <[email protected]>

* Add more semantic checks for amcl parameters (ros-navigation#2528)

* Fix null pointer in amcl on_cleanup

* Add more semantic checks for amcl

* fix possible use-after-free: unsafe shared_ptr in multithread (ros-navigation#2530)

Co-authored-by: Kai-Tao Xie <[email protected]>

* Hot fix rrp slow (ros-navigation#2526)

* review update

* updated the 2nd review comments

* String formatting

* Fix out of voxel grid array regression (ros-navigation#2460)

* Update dwb_local_planner.hpp (ros-navigation#2533)

Add remarks

* Add new test for smac_planner_2d (ros-navigation#2531)

* Add new test for smac_planner_2d

* Fix costmap initialization

* Change set_parameters() with set_parameters_atomically()

* Improving coverage

* Remove debug helper method

* Fix linting issue introduced in ros-navigation#2533 (ros-navigation#2539)

* [All 2D planners] Fix last pose orientation, fix small path and add ignore_goal_orientation parameter (ros-navigation#2488)

* end point orientation

* add ignore_goal_orientation to dyn param

* back()  instead of [path.poses.size() - 1]

* Smac2d use_final_approach_orientation name

* add in NavFn

* add in theta_star

* wip

* deal with navfn double end pose case

* add tests

* back and revert test smac2d

* get path hotfix

* navfn wip

* Corner cases

* Checks consistency accross the 3 2D planners

* comment

* interpolate final orientation in planner instead of smoother

* clarify and homogenize comments

* using same cell test instead of distance compared to resolution

* remove unneeded else

* lint

* fix smac2d goal orientation override

* fix and add tests

* update comment

* typo

* simplify if (_use_final_approach_orientation) block

* Use worldToMapEnforceBounds in clear_costmap_service (ros-navigation#2544)

to avoid buffer overflow

Signed-off-by: zouyonghao <[email protected]>

* Add new test for nav2_regulated_pure_pursuit (ros-navigation#2542)

* unit test for findDirChg

* lint fix

* add test for unchanged direction

* fix  for loop ending

* Enabled runtime configuration of parameters for Hybrid A* (ros-navigation#2540)

* Enabled runtime configuration of parameters for Hybrid A*

* Fix parameter name

* Fix parameter type

* fix pf_ use-before-initial in laserReceived() callback (ros-navigation#2550)

Co-authored-by: Kai-Tao Xie <[email protected]>

* add semantic checks (ros-navigation#2557)

Co-authored-by: Kai-Tao Xie <[email protected]>

* bumping galactic to 1.0.7

* Updates to Nav2 Theta Star Planner docs (ros-navigation#2559)

* - removing 'w_heuristic_cost_' from Nav2 Theta Star Planner as a user configurable parameter
    - updates to `nav2_theta_star_planner/README.md` to remove its reference wherever applicable
    - updates to `nav2_theta_star_planner/src/theta_star_planner.cpp` to set `w_heuristic_cost` as `std::min(1.0, w_euc_cost_)`
- fixed an incorrect check of whether the start and goal pose are the same in `nav2_theta_star_planner/src/theta_star_planner.cpp`

* Update theta_star_planner.hpp

clean up stuff from forced merge

* Update theta_star_planner.cpp

clean up stuff from a forced merge

* Update README.md

* Update theta_star_planner.cpp

Re-adding the goal to ensure, that the last pose, is the goal exactly

* fix linting issues

* Update theta_star_planner.cpp

Co-authored-by: Steve Macenski <[email protected]>

* Fixed vector::reserve exception in smac planner due to precision error (ros-navigation#2563)

- Related issue: ros-navigation#2547

Co-authored-by: gezp <[email protected]>
Co-authored-by: harderthan <[email protected]>
Co-authored-by: William Woodall <[email protected]>
Co-authored-by: Yousseflah <[email protected]>
Co-authored-by: YOUSSEF LAHROUNI <[email protected]>
Co-authored-by: Tim Clephas <[email protected]>
Co-authored-by: G.Doisy <[email protected]>
Co-authored-by: anaelle-sw <[email protected]>
Co-authored-by: philison <[email protected]>
Co-authored-by: Yong-Hao Zou <[email protected]>
Co-authored-by: easylyou <[email protected]>
Co-authored-by: Kai-Tao Xie <[email protected]>
Co-authored-by: Adam Aposhian <[email protected]>
Co-authored-by: Pradheep Krishna <[email protected]>
Co-authored-by: Alexey Merzlyakov <[email protected]>
Co-authored-by: Luca Bonamini <[email protected]>
Co-authored-by: Sathakkadhullah <[email protected]>
Co-authored-by: Anshumaan Singh <[email protected]>
Co-authored-by: zoltan-lengyel <[email protected]>

1.0.6

Toggle 1.0.6's commit message

Verified

This commit was created on GitHub.com and signed with GitHub’s verified signature. The key has expired.
Galactic sync 2 (June 9) (ros-navigation#2400)

* Increasing nav through poses remove point tolerance to 0.7 (ros-navigation#2387)

* bump to 1.0.6 for rerelease with galactic sync 2

1.0.5

Toggle 1.0.5's commit message
bumping to 1.0.5

1.0.4

Toggle 1.0.4's commit message
release for 1.0.4 for lifecycle depends fix

1.0.3

Toggle 1.0.3's commit message
bumping to 1.0.3

1.0.2

Toggle 1.0.2's commit message

Verified

This commit was created on GitHub.com and signed with GitHub’s verified signature. The key has expired.
Galactic sync 1 : All commits before May 24 (ros-navigation#2363)

* reset all goal checkers on cleanup state (ros-navigation#2354)

* Fix map_saver_cli arguments not parsed well (ros-navigation#2362)

Fixes ros-navigation#2358

* bumping to 1.0.2 for re-release with updates

Co-authored-by: Carlos Andrés Álvarez Restrepo <[email protected]>

1.0.1

Toggle 1.0.1's commit message
bump galactic to 1.0.1 for re-release

1.0.0

Toggle 1.0.0's commit message
bumping galactic to 1.0.0

0.4.7

Toggle 0.4.7's commit message
bump to 0.4.7 and add missing dep to RPP

0.4.6

Toggle 0.4.6's commit message
bumping to 0.4.6