Package Summary
Tags | No category tags. |
Version | 1.16.2 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Description | SARL*: Deep RL based human-aware navigation for mobile robot in crowded indoor environments implemented in ROS. |
Checkout URI | https://github.com/leekeyu/sarl_star.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2022-04-21 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | reinforcement-learning dqn crowd pedestrian-detection mobile-robot-navigation human-aware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Michael Ferguson
- David V. Lu!!
- Aaron Hoy
Authors
- Eitan Marder-Eppstein
- Eric Perko
- contradict
gmail.com
Changelog for package base_local_planner
1.16.2 (2018-07-31)
- Merge pull request #773 from ros-planning/packaging_fixes packaging fixes
- add explicit sensor_msgs, tf2 depends for base_local_planner
- Contributors: Michael Ferguson
1.16.1 (2018-07-28)
1.16.0 (2018-07-25)
- Remove PCL #765
- Switch to TF2 #755
- Fix trajectory obstacle scoring in dwa_local_planner.
- Make trajectory scoring scales consistent.
- unify parameter names between base_local_planner and dwa_local_planner addresses parts of #90
- fix param to min_in_place_vel_theta, closes #487
- add const to getLocalPlane, fixes #709
- Merge pull request #732 from marting87/small_typo_fixes Small typo fixes in ftrajectory_planner_ros and robot_pose_ekf
- Fixed typos for base_local_planner
- Contributors: Alexander Moriarty, David V. Lu, Martin Ganeff, Michael Ferguson, Pavlo Kolomiiets, Rein Appeldoorn, Vincent Rabaud, moriarty
1.15.2 (2018-03-22)
- Merge pull request #673 from ros-planning/email_update_lunar update maintainer email (lunar)
- CostmapModel: Make lineCost and pointCost public (#658) Make the methods [lineCost]{.title-ref} and [pointCost]{.title-ref} of the CostmapModel class public so they can be used outside of the class. Both methods are not changing the instance, so this should not cause any problems. To emphasise their constness, add the actual [const]{.title-ref} keyword.
- Merge pull request #649 from aaronhoy/lunar_add_ahoy Add myself as a maintainer.
- Contributors: Aaron Hoy, Felix Widmaier, Michael Ferguson
1.15.1 (2017-08-14)
1.15.0 (2017-08-07)
- set message_generation build and runtime dependency
- convert packages to format2
- cleaner logic, fixes #156
- Merge pull request #596 from ros-planning/lunar_548
- Add cost function to prevent unnecessary spinning
- Fix CMakeLists + package.xmls (#548)
- add missing deps on libpcl
- import only PCL common
- pcl proagate -lQt5::Widgets flag so we need to find_package Qt5Widgets (#578)
- make rostest in CMakeLists optional (ros/rosdistro#3010)
- remove GCC warnings
- Contributors: Lukas Bulwahn, Martin Günther, Michael Ferguson, Mikael Arguedas, Morgan Quigley, Vincent Rabaud, lengly
1.14.0 (2016-05-20)
1.13.1 (2015-10-29)
- base_local_planner: some fixes in goal_functions
- Merge pull request #348 from mikeferguson/trajectory_planner_fixes
- fix stuck_left/right calculation
- fix calculation of heading diff
- Contributors: Gael Ecorchard, Michael Ferguson
1.13.0 (2015-03-17)
- remove previously deprecated param
- Contributors: Michael Ferguson
1.12.0 (2015-02-04)
- update maintainer email
- Contributors: Michael Ferguson
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
eigen |
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged base_local_planner at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.16.2 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Description | SARL*: Deep RL based human-aware navigation for mobile robot in crowded indoor environments implemented in ROS. |
Checkout URI | https://github.com/leekeyu/sarl_star.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2022-04-21 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | reinforcement-learning dqn crowd pedestrian-detection mobile-robot-navigation human-aware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Michael Ferguson
- David V. Lu!!
- Aaron Hoy
Authors
- Eitan Marder-Eppstein
- Eric Perko
- contradict
gmail.com
Changelog for package base_local_planner
1.16.2 (2018-07-31)
- Merge pull request #773 from ros-planning/packaging_fixes packaging fixes
- add explicit sensor_msgs, tf2 depends for base_local_planner
- Contributors: Michael Ferguson
1.16.1 (2018-07-28)
1.16.0 (2018-07-25)
- Remove PCL #765
- Switch to TF2 #755
- Fix trajectory obstacle scoring in dwa_local_planner.
- Make trajectory scoring scales consistent.
- unify parameter names between base_local_planner and dwa_local_planner addresses parts of #90
- fix param to min_in_place_vel_theta, closes #487
- add const to getLocalPlane, fixes #709
- Merge pull request #732 from marting87/small_typo_fixes Small typo fixes in ftrajectory_planner_ros and robot_pose_ekf
- Fixed typos for base_local_planner
- Contributors: Alexander Moriarty, David V. Lu, Martin Ganeff, Michael Ferguson, Pavlo Kolomiiets, Rein Appeldoorn, Vincent Rabaud, moriarty
1.15.2 (2018-03-22)
- Merge pull request #673 from ros-planning/email_update_lunar update maintainer email (lunar)
- CostmapModel: Make lineCost and pointCost public (#658) Make the methods [lineCost]{.title-ref} and [pointCost]{.title-ref} of the CostmapModel class public so they can be used outside of the class. Both methods are not changing the instance, so this should not cause any problems. To emphasise their constness, add the actual [const]{.title-ref} keyword.
- Merge pull request #649 from aaronhoy/lunar_add_ahoy Add myself as a maintainer.
- Contributors: Aaron Hoy, Felix Widmaier, Michael Ferguson
1.15.1 (2017-08-14)
1.15.0 (2017-08-07)
- set message_generation build and runtime dependency
- convert packages to format2
- cleaner logic, fixes #156
- Merge pull request #596 from ros-planning/lunar_548
- Add cost function to prevent unnecessary spinning
- Fix CMakeLists + package.xmls (#548)
- add missing deps on libpcl
- import only PCL common
- pcl proagate -lQt5::Widgets flag so we need to find_package Qt5Widgets (#578)
- make rostest in CMakeLists optional (ros/rosdistro#3010)
- remove GCC warnings
- Contributors: Lukas Bulwahn, Martin Günther, Michael Ferguson, Mikael Arguedas, Morgan Quigley, Vincent Rabaud, lengly
1.14.0 (2016-05-20)
1.13.1 (2015-10-29)
- base_local_planner: some fixes in goal_functions
- Merge pull request #348 from mikeferguson/trajectory_planner_fixes
- fix stuck_left/right calculation
- fix calculation of heading diff
- Contributors: Gael Ecorchard, Michael Ferguson
1.13.0 (2015-03-17)
- remove previously deprecated param
- Contributors: Michael Ferguson
1.12.0 (2015-02-04)
- update maintainer email
- Contributors: Michael Ferguson
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
eigen |
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged base_local_planner at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.16.2 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Description | SARL*: Deep RL based human-aware navigation for mobile robot in crowded indoor environments implemented in ROS. |
Checkout URI | https://github.com/leekeyu/sarl_star.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2022-04-21 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | reinforcement-learning dqn crowd pedestrian-detection mobile-robot-navigation human-aware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Michael Ferguson
- David V. Lu!!
- Aaron Hoy
Authors
- Eitan Marder-Eppstein
- Eric Perko
- contradict
gmail.com
Changelog for package base_local_planner
1.16.2 (2018-07-31)
- Merge pull request #773 from ros-planning/packaging_fixes packaging fixes
- add explicit sensor_msgs, tf2 depends for base_local_planner
- Contributors: Michael Ferguson
1.16.1 (2018-07-28)
1.16.0 (2018-07-25)
- Remove PCL #765
- Switch to TF2 #755
- Fix trajectory obstacle scoring in dwa_local_planner.
- Make trajectory scoring scales consistent.
- unify parameter names between base_local_planner and dwa_local_planner addresses parts of #90
- fix param to min_in_place_vel_theta, closes #487
- add const to getLocalPlane, fixes #709
- Merge pull request #732 from marting87/small_typo_fixes Small typo fixes in ftrajectory_planner_ros and robot_pose_ekf
- Fixed typos for base_local_planner
- Contributors: Alexander Moriarty, David V. Lu, Martin Ganeff, Michael Ferguson, Pavlo Kolomiiets, Rein Appeldoorn, Vincent Rabaud, moriarty
1.15.2 (2018-03-22)
- Merge pull request #673 from ros-planning/email_update_lunar update maintainer email (lunar)
- CostmapModel: Make lineCost and pointCost public (#658) Make the methods [lineCost]{.title-ref} and [pointCost]{.title-ref} of the CostmapModel class public so they can be used outside of the class. Both methods are not changing the instance, so this should not cause any problems. To emphasise their constness, add the actual [const]{.title-ref} keyword.
- Merge pull request #649 from aaronhoy/lunar_add_ahoy Add myself as a maintainer.
- Contributors: Aaron Hoy, Felix Widmaier, Michael Ferguson
1.15.1 (2017-08-14)
1.15.0 (2017-08-07)
- set message_generation build and runtime dependency
- convert packages to format2
- cleaner logic, fixes #156
- Merge pull request #596 from ros-planning/lunar_548
- Add cost function to prevent unnecessary spinning
- Fix CMakeLists + package.xmls (#548)
- add missing deps on libpcl
- import only PCL common
- pcl proagate -lQt5::Widgets flag so we need to find_package Qt5Widgets (#578)
- make rostest in CMakeLists optional (ros/rosdistro#3010)
- remove GCC warnings
- Contributors: Lukas Bulwahn, Martin Günther, Michael Ferguson, Mikael Arguedas, Morgan Quigley, Vincent Rabaud, lengly
1.14.0 (2016-05-20)
1.13.1 (2015-10-29)
- base_local_planner: some fixes in goal_functions
- Merge pull request #348 from mikeferguson/trajectory_planner_fixes
- fix stuck_left/right calculation
- fix calculation of heading diff
- Contributors: Gael Ecorchard, Michael Ferguson
1.13.0 (2015-03-17)
- remove previously deprecated param
- Contributors: Michael Ferguson
1.12.0 (2015-02-04)
- update maintainer email
- Contributors: Michael Ferguson
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
eigen |
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged base_local_planner at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.16.2 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Description | SARL*: Deep RL based human-aware navigation for mobile robot in crowded indoor environments implemented in ROS. |
Checkout URI | https://github.com/leekeyu/sarl_star.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2022-04-21 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | reinforcement-learning dqn crowd pedestrian-detection mobile-robot-navigation human-aware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Michael Ferguson
- David V. Lu!!
- Aaron Hoy
Authors
- Eitan Marder-Eppstein
- Eric Perko
- contradict
gmail.com
Changelog for package base_local_planner
1.16.2 (2018-07-31)
- Merge pull request #773 from ros-planning/packaging_fixes packaging fixes
- add explicit sensor_msgs, tf2 depends for base_local_planner
- Contributors: Michael Ferguson
1.16.1 (2018-07-28)
1.16.0 (2018-07-25)
- Remove PCL #765
- Switch to TF2 #755
- Fix trajectory obstacle scoring in dwa_local_planner.
- Make trajectory scoring scales consistent.
- unify parameter names between base_local_planner and dwa_local_planner addresses parts of #90
- fix param to min_in_place_vel_theta, closes #487
- add const to getLocalPlane, fixes #709
- Merge pull request #732 from marting87/small_typo_fixes Small typo fixes in ftrajectory_planner_ros and robot_pose_ekf
- Fixed typos for base_local_planner
- Contributors: Alexander Moriarty, David V. Lu, Martin Ganeff, Michael Ferguson, Pavlo Kolomiiets, Rein Appeldoorn, Vincent Rabaud, moriarty
1.15.2 (2018-03-22)
- Merge pull request #673 from ros-planning/email_update_lunar update maintainer email (lunar)
- CostmapModel: Make lineCost and pointCost public (#658) Make the methods [lineCost]{.title-ref} and [pointCost]{.title-ref} of the CostmapModel class public so they can be used outside of the class. Both methods are not changing the instance, so this should not cause any problems. To emphasise their constness, add the actual [const]{.title-ref} keyword.
- Merge pull request #649 from aaronhoy/lunar_add_ahoy Add myself as a maintainer.
- Contributors: Aaron Hoy, Felix Widmaier, Michael Ferguson
1.15.1 (2017-08-14)
1.15.0 (2017-08-07)
- set message_generation build and runtime dependency
- convert packages to format2
- cleaner logic, fixes #156
- Merge pull request #596 from ros-planning/lunar_548
- Add cost function to prevent unnecessary spinning
- Fix CMakeLists + package.xmls (#548)
- add missing deps on libpcl
- import only PCL common
- pcl proagate -lQt5::Widgets flag so we need to find_package Qt5Widgets (#578)
- make rostest in CMakeLists optional (ros/rosdistro#3010)
- remove GCC warnings
- Contributors: Lukas Bulwahn, Martin Günther, Michael Ferguson, Mikael Arguedas, Morgan Quigley, Vincent Rabaud, lengly
1.14.0 (2016-05-20)
1.13.1 (2015-10-29)
- base_local_planner: some fixes in goal_functions
- Merge pull request #348 from mikeferguson/trajectory_planner_fixes
- fix stuck_left/right calculation
- fix calculation of heading diff
- Contributors: Gael Ecorchard, Michael Ferguson
1.13.0 (2015-03-17)
- remove previously deprecated param
- Contributors: Michael Ferguson
1.12.0 (2015-02-04)
- update maintainer email
- Contributors: Michael Ferguson
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
eigen |
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged base_local_planner at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.16.2 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Description | SARL*: Deep RL based human-aware navigation for mobile robot in crowded indoor environments implemented in ROS. |
Checkout URI | https://github.com/leekeyu/sarl_star.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2022-04-21 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | reinforcement-learning dqn crowd pedestrian-detection mobile-robot-navigation human-aware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Michael Ferguson
- David V. Lu!!
- Aaron Hoy
Authors
- Eitan Marder-Eppstein
- Eric Perko
- contradict
gmail.com
Changelog for package base_local_planner
1.16.2 (2018-07-31)
- Merge pull request #773 from ros-planning/packaging_fixes packaging fixes
- add explicit sensor_msgs, tf2 depends for base_local_planner
- Contributors: Michael Ferguson
1.16.1 (2018-07-28)
1.16.0 (2018-07-25)
- Remove PCL #765
- Switch to TF2 #755
- Fix trajectory obstacle scoring in dwa_local_planner.
- Make trajectory scoring scales consistent.
- unify parameter names between base_local_planner and dwa_local_planner addresses parts of #90
- fix param to min_in_place_vel_theta, closes #487
- add const to getLocalPlane, fixes #709
- Merge pull request #732 from marting87/small_typo_fixes Small typo fixes in ftrajectory_planner_ros and robot_pose_ekf
- Fixed typos for base_local_planner
- Contributors: Alexander Moriarty, David V. Lu, Martin Ganeff, Michael Ferguson, Pavlo Kolomiiets, Rein Appeldoorn, Vincent Rabaud, moriarty
1.15.2 (2018-03-22)
- Merge pull request #673 from ros-planning/email_update_lunar update maintainer email (lunar)
- CostmapModel: Make lineCost and pointCost public (#658) Make the methods [lineCost]{.title-ref} and [pointCost]{.title-ref} of the CostmapModel class public so they can be used outside of the class. Both methods are not changing the instance, so this should not cause any problems. To emphasise their constness, add the actual [const]{.title-ref} keyword.
- Merge pull request #649 from aaronhoy/lunar_add_ahoy Add myself as a maintainer.
- Contributors: Aaron Hoy, Felix Widmaier, Michael Ferguson
1.15.1 (2017-08-14)
1.15.0 (2017-08-07)
- set message_generation build and runtime dependency
- convert packages to format2
- cleaner logic, fixes #156
- Merge pull request #596 from ros-planning/lunar_548
- Add cost function to prevent unnecessary spinning
- Fix CMakeLists + package.xmls (#548)
- add missing deps on libpcl
- import only PCL common
- pcl proagate -lQt5::Widgets flag so we need to find_package Qt5Widgets (#578)
- make rostest in CMakeLists optional (ros/rosdistro#3010)
- remove GCC warnings
- Contributors: Lukas Bulwahn, Martin Günther, Michael Ferguson, Mikael Arguedas, Morgan Quigley, Vincent Rabaud, lengly
1.14.0 (2016-05-20)
1.13.1 (2015-10-29)
- base_local_planner: some fixes in goal_functions
- Merge pull request #348 from mikeferguson/trajectory_planner_fixes
- fix stuck_left/right calculation
- fix calculation of heading diff
- Contributors: Gael Ecorchard, Michael Ferguson
1.13.0 (2015-03-17)
- remove previously deprecated param
- Contributors: Michael Ferguson
1.12.0 (2015-02-04)
- update maintainer email
- Contributors: Michael Ferguson
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
eigen |
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged base_local_planner at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.16.2 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Description | SARL*: Deep RL based human-aware navigation for mobile robot in crowded indoor environments implemented in ROS. |
Checkout URI | https://github.com/leekeyu/sarl_star.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2022-04-21 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | reinforcement-learning dqn crowd pedestrian-detection mobile-robot-navigation human-aware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Michael Ferguson
- David V. Lu!!
- Aaron Hoy
Authors
- Eitan Marder-Eppstein
- Eric Perko
- contradict
gmail.com
Changelog for package base_local_planner
1.16.2 (2018-07-31)
- Merge pull request #773 from ros-planning/packaging_fixes packaging fixes
- add explicit sensor_msgs, tf2 depends for base_local_planner
- Contributors: Michael Ferguson
1.16.1 (2018-07-28)
1.16.0 (2018-07-25)
- Remove PCL #765
- Switch to TF2 #755
- Fix trajectory obstacle scoring in dwa_local_planner.
- Make trajectory scoring scales consistent.
- unify parameter names between base_local_planner and dwa_local_planner addresses parts of #90
- fix param to min_in_place_vel_theta, closes #487
- add const to getLocalPlane, fixes #709
- Merge pull request #732 from marting87/small_typo_fixes Small typo fixes in ftrajectory_planner_ros and robot_pose_ekf
- Fixed typos for base_local_planner
- Contributors: Alexander Moriarty, David V. Lu, Martin Ganeff, Michael Ferguson, Pavlo Kolomiiets, Rein Appeldoorn, Vincent Rabaud, moriarty
1.15.2 (2018-03-22)
- Merge pull request #673 from ros-planning/email_update_lunar update maintainer email (lunar)
- CostmapModel: Make lineCost and pointCost public (#658) Make the methods [lineCost]{.title-ref} and [pointCost]{.title-ref} of the CostmapModel class public so they can be used outside of the class. Both methods are not changing the instance, so this should not cause any problems. To emphasise their constness, add the actual [const]{.title-ref} keyword.
- Merge pull request #649 from aaronhoy/lunar_add_ahoy Add myself as a maintainer.
- Contributors: Aaron Hoy, Felix Widmaier, Michael Ferguson
1.15.1 (2017-08-14)
1.15.0 (2017-08-07)
- set message_generation build and runtime dependency
- convert packages to format2
- cleaner logic, fixes #156
- Merge pull request #596 from ros-planning/lunar_548
- Add cost function to prevent unnecessary spinning
- Fix CMakeLists + package.xmls (#548)
- add missing deps on libpcl
- import only PCL common
- pcl proagate -lQt5::Widgets flag so we need to find_package Qt5Widgets (#578)
- make rostest in CMakeLists optional (ros/rosdistro#3010)
- remove GCC warnings
- Contributors: Lukas Bulwahn, Martin Günther, Michael Ferguson, Mikael Arguedas, Morgan Quigley, Vincent Rabaud, lengly
1.14.0 (2016-05-20)
1.13.1 (2015-10-29)
- base_local_planner: some fixes in goal_functions
- Merge pull request #348 from mikeferguson/trajectory_planner_fixes
- fix stuck_left/right calculation
- fix calculation of heading diff
- Contributors: Gael Ecorchard, Michael Ferguson
1.13.0 (2015-03-17)
- remove previously deprecated param
- Contributors: Michael Ferguson
1.12.0 (2015-02-04)
- update maintainer email
- Contributors: Michael Ferguson
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
eigen |
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged base_local_planner at Robotics Stack Exchange
Package Summary
Tags | No category tags. |
Version | 1.16.2 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Description | SARL*: Deep RL based human-aware navigation for mobile robot in crowded indoor environments implemented in ROS. |
Checkout URI | https://github.com/leekeyu/sarl_star.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2022-04-21 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | reinforcement-learning dqn crowd pedestrian-detection mobile-robot-navigation human-aware |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Michael Ferguson
- David V. Lu!!
- Aaron Hoy
Authors
- Eitan Marder-Eppstein
- Eric Perko
- contradict
gmail.com
Changelog for package base_local_planner
1.16.2 (2018-07-31)
- Merge pull request #773 from ros-planning/packaging_fixes packaging fixes
- add explicit sensor_msgs, tf2 depends for base_local_planner
- Contributors: Michael Ferguson
1.16.1 (2018-07-28)
1.16.0 (2018-07-25)
- Remove PCL #765
- Switch to TF2 #755
- Fix trajectory obstacle scoring in dwa_local_planner.
- Make trajectory scoring scales consistent.
- unify parameter names between base_local_planner and dwa_local_planner addresses parts of #90
- fix param to min_in_place_vel_theta, closes #487
- add const to getLocalPlane, fixes #709
- Merge pull request #732 from marting87/small_typo_fixes Small typo fixes in ftrajectory_planner_ros and robot_pose_ekf
- Fixed typos for base_local_planner
- Contributors: Alexander Moriarty, David V. Lu, Martin Ganeff, Michael Ferguson, Pavlo Kolomiiets, Rein Appeldoorn, Vincent Rabaud, moriarty
1.15.2 (2018-03-22)
- Merge pull request #673 from ros-planning/email_update_lunar update maintainer email (lunar)
- CostmapModel: Make lineCost and pointCost public (#658) Make the methods [lineCost]{.title-ref} and [pointCost]{.title-ref} of the CostmapModel class public so they can be used outside of the class. Both methods are not changing the instance, so this should not cause any problems. To emphasise their constness, add the actual [const]{.title-ref} keyword.
- Merge pull request #649 from aaronhoy/lunar_add_ahoy Add myself as a maintainer.
- Contributors: Aaron Hoy, Felix Widmaier, Michael Ferguson
1.15.1 (2017-08-14)
1.15.0 (2017-08-07)
- set message_generation build and runtime dependency
- convert packages to format2
- cleaner logic, fixes #156
- Merge pull request #596 from ros-planning/lunar_548
- Add cost function to prevent unnecessary spinning
- Fix CMakeLists + package.xmls (#548)
- add missing deps on libpcl
- import only PCL common
- pcl proagate -lQt5::Widgets flag so we need to find_package Qt5Widgets (#578)
- make rostest in CMakeLists optional (ros/rosdistro#3010)
- remove GCC warnings
- Contributors: Lukas Bulwahn, Martin Günther, Michael Ferguson, Mikael Arguedas, Morgan Quigley, Vincent Rabaud, lengly
1.14.0 (2016-05-20)
1.13.1 (2015-10-29)
- base_local_planner: some fixes in goal_functions
- Merge pull request #348 from mikeferguson/trajectory_planner_fixes
- fix stuck_left/right calculation
- fix calculation of heading diff
- Contributors: Gael Ecorchard, Michael Ferguson
1.13.0 (2015-03-17)
- remove previously deprecated param
- Contributors: Michael Ferguson
1.12.0 (2015-02-04)
- update maintainer email
- Contributors: Michael Ferguson
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
eigen |
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged base_local_planner at Robotics Stack Exchange
![]() |
base_local_planner package from navigation repoamcl base_local_planner carrot_planner clear_costmap_recovery costmap_2d dwa_local_planner fake_localization global_planner map_server move_base move_slow_and_clear nav_core navfn navigation rotate_recovery voxel_grid |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 1.16.7 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Description | ROS Navigation stack. Code for finding where the robot is and how it can get somewhere else. |
Checkout URI | https://github.com/ros-planning/navigation.git |
VCS Type | git |
VCS Version | melodic-devel |
Last Updated | 2022-06-20 |
Dev Status | MAINTAINED |
Released | RELEASED |
Tags | robotics navigation ros |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Michael Ferguson
- David V. Lu!!
- Aaron Hoy
Authors
- Eitan Marder-Eppstein
- Eric Perko
- contradict
gmail.com
Changelog for package base_local_planner
1.16.7 (2020-08-27)
- occdist_scale should not be scaled by the costmap resolution as it doesn't multiply a value that includes a distance. (#1000)
- Contributors: wjwagner
1.16.6 (2020-03-18)
- Fix Unknown CMake command check_include_file (navfn & base_local_planner) (#975)
- Contributors: Sam Pfeiffer
1.16.5 (2020-03-15)
- [melodic] updated install for better portability. (#973)
- Contributors: Sean Yen
1.16.4 (2020-03-04)
- Fixes gdist- and pdist_scale node paramter names (#936) Renames goal and path distance dynamic reconfigure parameter names in the cfg file in order to actually make the parameters used by the trajectory planner changeable. Fixes #935
- don't include a main() function in base_local_planner library (#969)
- [Windows][melodic] Navigation (except for map_server and amcl) Windows build bring up (#851)
- Contributors: David Leins, Sean Yen, ipa-fez
1.16.3 (2019-11-15)
- Merge branch 'melodic-devel' into layer_clear_area-melodic
- Provide different negative values for unknown and out-of-map costs (#833)
- Merge pull request #857 from jspricke/add_include Add missing header
- Add missing header
- [kinetic] Fix for adjusting plan resolution
(#819)
- Fix for adjusting plan resolution
- Simpler math expression
- Contributors: David V. Lu!!, Jochen Sprickerhof, Jorge Santos Simón, Michael Ferguson, Steven Macenski
1.16.2 (2018-07-31)
- Merge pull request #773 from ros-planning/packaging_fixes packaging fixes
- add explicit sensor_msgs, tf2 depends for base_local_planner
- Contributors: Michael Ferguson
1.16.1 (2018-07-28)
1.16.0 (2018-07-25)
- Remove PCL #765
- Switch to TF2 #755
- Fix trajectory obstacle scoring in dwa_local_planner.
- Make trajectory scoring scales consistent.
- unify parameter names between base_local_planner and dwa_local_planner addresses parts of #90
- fix param to min_in_place_vel_theta, closes #487
- add const to getLocalPlane, fixes #709
- Merge pull request #732 from marting87/small_typo_fixes Small typo fixes in ftrajectory_planner_ros and robot_pose_ekf
- Fixed typos for base_local_planner
- Contributors: Alexander Moriarty, David V. Lu, Martin Ganeff, Michael Ferguson, Pavlo Kolomiiets, Rein Appeldoorn, Vincent Rabaud, moriarty
1.15.2 (2018-03-22)
- Merge pull request #673 from ros-planning/email_update_lunar update maintainer email (lunar)
- CostmapModel: Make lineCost and pointCost public (#658) Make the methods [lineCost]{.title-ref} and [pointCost]{.title-ref} of the CostmapModel class public so they can be used outside of the class. Both methods are not changing the instance, so this should not cause any problems. To emphasise their constness, add the actual [const]{.title-ref} keyword.
- Merge pull request
File truncated at 100 lines see the full file
Package Dependencies
System Dependencies
Name |
---|
eigen |
Dependant Packages
Launch files
Messages
Services
Plugins
Recent questions tagged base_local_planner at Robotics Stack Exchange
![]() |
base_local_planner package from navigation repoamcl base_local_planner carrot_planner clear_costmap_recovery costmap_2d dwa_local_planner fake_localization global_planner map_server move_base move_slow_and_clear nav_core navfn navigation rotate_recovery voxel_grid |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 1.17.3 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Description | ROS Navigation stack. Code for finding where the robot is and how it can get somewhere else. |
Checkout URI | https://github.com/ros-planning/navigation.git |
VCS Type | git |
VCS Version | noetic-devel |
Last Updated | 2025-06-04 |
Dev Status | MAINTAINED |
Released | RELEASED |
Tags | robotics navigation ros |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Michael Ferguson
- David V. Lu!!
- Aaron Hoy
Authors
- Eitan Marder-Eppstein
- Eric Perko
- contradict
gmail.com
Changelog for package base_local_planner
1.17.3 (2023-01-10)
-
[ROS-O] various patches (#1225)
* do not specify obsolete c++11 standard this breaks with current versions of log4cxx.
* update pluginlib include paths the non-hpp headers have been deprecated since kinetic
* use lambdas in favor of boost::bind Using boost's _1 as a global system is deprecated since C++11. The ROS packages in Debian removed the implicit support for the global symbols, so this code fails to compile there without the patch.
-
Contributors: Michael Görner
1.17.2 (2022-06-20)
- Commit 89a8593 removed footprint scaling. This brings it back. (#886) (#1204) Co-authored-by: Frank Höller <<frank.hoeller@fkie.fraunhofer.de>>
- Contributors: Michael Ferguson
1.17.1 (2020-08-27)
- occdist_scale should not be scaled by the costmap resolution as it doesn't multiply a value that includes a distance. (#1000)
- Contributors: wjwagner
1.17.0 (2020-04-02)
- Merge pull request #982 from ros-planning/noetic_prep Noetic Migration
- increase required cmake version
- Contributors: Michael Ferguson
1.16.6 (2020-03-18)
- Fix Unknown CMake command check_include_file (navfn & base_local_planner) (#975)
- Contributors: Sam Pfeiffer
1.16.5 (2020-03-15)
- [melodic] updated install for better portability. (#973)
- Contributors: Sean Yen
1.16.4 (2020-03-04)
- Fixes gdist- and pdist_scale node paramter names (#936) Renames goal and path distance dynamic reconfigure parameter names in the cfg file in order to actually make the parameters used by the trajectory planner changeable. Fixes #935
- don't include a main() function in base_local_planner library (#969)
- [Windows][melodic] Navigation (except for map_server and amcl) Windows build bring up (#851)
- Contributors: David Leins, Sean Yen, ipa-fez
1.16.3 (2019-11-15)
- Merge branch 'melodic-devel' into layer_clear_area-melodic
- Provide different negative values for unknown and out-of-map costs (#833)
- Merge pull request #857 from jspricke/add_include Add missing header
- Add missing header
- [kinetic] Fix for adjusting plan resolution
(#819)
- Fix for adjusting plan resolution
- Simpler math expression
- Contributors: David V. Lu!!, Jochen Sprickerhof, Jorge Santos Simón, Michael Ferguson, Steven Macenski
1.16.2 (2018-07-31)
- Merge pull request #773 from ros-planning/packaging_fixes packaging fixes
- add explicit sensor_msgs, tf2 depends for base_local_planner
- Contributors: Michael Ferguson
1.16.1 (2018-07-28)
1.16.0 (2018-07-25)
- Remove PCL
File truncated at 100 lines see the full file