Package Summary

Tags No category tags.
Version 1.17.3
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-planning/navigation.git
VCS Type git
VCS Version noetic-devel
Last Updated 2023-03-04
Dev Status MAINTAINED
CI status
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

This package provides an implementation of a 2D costmap that takes in sensor data from the world, builds a 2D or 3D occupancy grid of the data (depending on whether a voxel based implementation is used), and inflates costs in a 2D costmap based on the occupancy grid and a user specified inflation radius. This package also provides support for map_server based initialization of a costmap, rolling window based costmaps, and parameter based subscription to and configuration of sensor topics.

Additional Links

Maintainers

  • David V. Lu!!
  • Michael Ferguson
  • Aaron Hoy

Authors

  • Eitan Marder-Eppstein
  • David V. Lu!!
  • Dave Hershberger
  • contradict gmail.com
README
No README found. See repository README.
CHANGELOG

Changelog for package costmap_2d

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

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
cob_collision_velocity_filter github-4am-robotics-cob_control
cob_bringup github-ipa320-cob_robots
cob_hardware_config github-ipa320-cob_robots
costmap_converter github-rst-tu-dortmund-costmap_converter
fetch_depth_layer github-fetchrobotics-fetch_ros
fetch_navigation github-fetchrobotics-fetch_ros
graceful_controller_ros github-mikeferguson-graceful_controller
grid_map_costmap_2d github-anybotics-grid_map
explore_lite github-hrnr-m-explore
mbf_costmap_core github-magazino-move_base_flex
mbf_costmap_nav github-magazino-move_base_flex
move_base_swp github-ihadzic-move_base_swp
mpc_local_planner github-rst-tu-dortmund-mpc_local_planner
base_local_planner github-ros-planning-navigation
carrot_planner github-ros-planning-navigation
clear_costmap_recovery github-ros-planning-navigation
dwa_local_planner github-ros-planning-navigation
global_planner github-ros-planning-navigation
move_base github-ros-planning-navigation
move_slow_and_clear github-ros-planning-navigation
nav_core github-ros-planning-navigation
navfn github-ros-planning-navigation
navigation github-ros-planning-navigation
rotate_recovery github-ros-planning-navigation
nav2d_operator github-skasperski-navigation_2d
assisted_teleop github-ros-planning-navigation_experimental
goal_passer github-ros-planning-navigation_experimental
pose_follower github-ros-planning-navigation_experimental
sbpl_lattice_planner github-ros-planning-navigation_experimental
sbpl_recovery github-ros-planning-navigation_experimental
twist_recovery github-ros-planning-navigation_experimental
neo_local_planner github-neobotix-neo_local_planner
nonpersistent_voxel_layer github-SteveMacenski-nonpersistent_voxel_layer
nav_core_adapter github-locusrobotics-robot_navigation
rtabmap_costmap_plugins github-introlab-rtabmap_ros
backward_global_planner github-robosoft-ai-smacc
backward_local_planner github-robosoft-ai-smacc
forward_global_planner github-robosoft-ai-smacc
forward_local_planner github-robosoft-ai-smacc
pure_spinning_local_planner github-robosoft-ai-smacc
undo_path_global_planner github-robosoft-ai-smacc
spatio_temporal_voxel_layer github-SteveMacenski-spatio_temporal_voxel_layer
steering_functions github-hbanzhaf-steering_functions
teb_local_planner github-rst-tu-dortmund-teb_local_planner
clober_navigation github-CLOBOT-Co-Ltd-clober
gpp_interface github-dorezyuk-gpp
gpp_plugin github-dorezyuk-gpp
sob_layer github-dorezyuk-sob_layer

Recent questions tagged costmap_2d at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.15.2
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-planning/navigation.git
VCS Type git
VCS Version lunar
Last Updated 2019-02-28
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

This package provides an implementation of a 2D costmap that takes in sensor data from the world, builds a 2D or 3D occupancy grid of the data (depending on whether a voxel based implementation is used), and inflates costs in a 2D costmap based on the occupancy grid and a user specified inflation radius. This package also provides support for map_server based initialization of a costmap, rolling window based costmaps, and parameter based subscription to and configuration of sensor topics.

Additional Links

Maintainers

  • David V. Lu!!
  • Michael Ferguson
  • Aaron Hoy

Authors

  • Eitan Marder-Eppstein
  • David V. Lu!!
  • Dave Hershberger
  • contradict gmail.com
README
No README found. See repository README.
CHANGELOG

Changelog for package costmap_2d

1.15.2 (2018-03-22)

  • Merge pull request #673 from ros-planning/email_update_lunar update maintainer email (lunar)
  • Merge pull request #670 from DLu/fix206_lunar Fixes #206 for Lunar
  • fix \'enable\' for static_layer with rolling window (#659) (#665)
  • Merge pull request #649 from aaronhoy/lunar_add_ahoy Add myself as a maintainer.
  • Contributors: Aaron Hoy, David V. Lu!!, Jannik Abbenseth, Michael Ferguson

1.15.1 (2017-08-14)

1.15.0 (2017-08-07)

  • Added parameter for allowing inflation in unknown cells (#564)
  • Inflation Layer protected members and virtual computeCost [ABI BREAKING]
  • Fix for #517: create a getRobotPose method on move_base instead of using that on the costmaps
  • don\'t update costs if inflation radius is zero
  • rebase fixups
  • convert packages to format2
  • Speedup (~60%) inflation layer update (#525)
  • 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)
  • Added deps to amcl costmap_2d move_base (#512)
  • remove GCC warnings
  • Fix CMake warnings
  • renamed targets for message generation (gencpp -> generate_messages_cpp) in order to avoid warnings for non-existing target dependencies
  • Fixed race condition with costmaps
  • Merge pull request #491 from alexhenning/kinetic-inflation-fix
  • Fixed sign error in inflation layer
  • Adds warning when a layer shrinks the bounds
  • Fixed bug with inflation layer that caused underinflation
  • Fixed bug with artifacts when not current
  • Fix bug with inflation artifacts being left behind
  • Fixes issue with costmaps shearing
  • Made costmap publishing truly lazy
  • Contributors: Alex Henning, Alexander Reimann, Hidde Wieringa, Jorge Santos, Jorge Santos Sim

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Recent questions tagged costmap_2d at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.13.1
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-planning/navigation.git
VCS Type git
VCS Version jade-devel
Last Updated 2017-08-01
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

This package provides an implementation of a 2D costmap that takes in sensor data from the world, builds a 2D or 3D occupancy grid of the data (depending on whether a voxel based implementation is used), and inflates costs in a 2D costmap based on the occupancy grid and a user specified inflation radius. This package also provides support for map_server based initialization of a costmap, rolling window based costmaps, and parameter based subscription to and configuration of sensor topics.

Additional Links

Maintainers

  • David V. Lu!!
  • Michael Ferguson

Authors

  • Eitan Marder-Eppstein
  • David V. Lu!!
  • Dave Hershberger
  • contradict gmail.com
README
No README found. See repository README.
CHANGELOG

Changelog for package costmap_2d

1.13.1 (2015-10-29)

  • Remove excessive canTransform spam.
  • Fix for #382
  • Republish costmap if origin changes
  • Remove Footprint Layer
  • Remove extra sign definition and use proper one when padding footprint
  • fix plugin warnings on throw, closes #205
  • initialize publisher variables
  • Look for robot_radius when footprint is not set. #206
  • Add a first_map_only parameter so we keep reusing the first received static map
  • Merge pull request #331 from mikeferguson/static_layer_any_frame
  • support rolling static map in any frame
  • fix destructor of Costmap2D
  • proper locking during costmap update
  • do not resize static map when rolling
  • Static layer works with rolling window now
  • Contributors: Daniel Stonier, David Lu, Jihoon Lee, Michael Ferguson, Rein Appeldoorn, commaster90

1.13.0 (2015-03-17)

  • fixed issue with voxel_layer and obstacle_layer both deleting the same dynamic_reconfigure::Server and causing segfaults
  • Fixing various memory freeing operations
  • static_layer: Fix indexing error in OccupancyGridUpdate callback function.
  • Contributors: Alex Bencz, David V. Lu!!, James Servos, Julse, Kaijen Hsiao

1.12.0 (2015-02-04)

  • update maintainer email
  • Contributors: Michael Ferguson

1.11.15 (2015-02-03)

  • Add ARCHIVE_DESTINATION for static builds
  • Contributors: Gary Servin

1.11.14 (2014-12-05)

  • added waitForTransform to bufferCloud to solve extrapolation into the future exception
  • deallocate costmap before reallocating
  • prevent div by zero in raytraceLine
  • only prefix sensor_frame when it\'s not empty
  • tf_prefix support in obstacle_layer
  • remove undefined function updateUsingPlugins
  • remove unused cell_data.h
  • numerous style fixes
  • Contributors: Andrzej Pronobis, David Lu, Jeremie Deray, Mani Monajjemi, Michael Ferguson, enriquefernandez

1.11.13 (2014-10-02)

1.11.12 (2014-10-01)

  • costmap_2d: export library layers
  • Merge pull request #198 from kmhallen/hydro-devel Fixed costmap_2d clearing from service /move_base/clear_costmaps
  • Costmap Layer comments
  • Add destructors for all of the layers to remove the dynamic parameter clients
  • Add method for removing static observations (for testing)
  • Move testing_helper
  • Initial Clearing Costmap parameter change
  • Fixed costmap_2d clearing from service /move_base/clear_costmaps
  • Contributors: David Lu!!, Kevin Hallenbeck, Michael Ferguson

1.11.11 (2014-07-23)

  • removes trailing spaces and empty lines
  • Contributors: Enrique Fern

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Recent questions tagged costmap_2d at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.12.16
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-planning/navigation.git
VCS Type git
VCS Version indigo-devel
Last Updated 2019-02-28
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

This package provides an implementation of a 2D costmap that takes in sensor data from the world, builds a 2D or 3D occupancy grid of the data (depending on whether a voxel based implementation is used), and inflates costs in a 2D costmap based on the occupancy grid and a user specified inflation radius. This package also provides support for map_server based initialization of a costmap, rolling window based costmaps, and parameter based subscription to and configuration of sensor topics.

Additional Links

Maintainers

  • David V. Lu!!
  • Michael Ferguson
  • Aaron Hoy

Authors

  • Eitan Marder-Eppstein
  • David V. Lu!!
  • Dave Hershberger
  • contradict gmail.com
README
No README found. See repository README.
CHANGELOG

Changelog for package costmap_2d

1.12.16 (2018-06-19)

  • Merge pull request #695 from ros-planning/indigo_675 Fixed race condition with costmaps in LayeredCostmap::resizeMap() (backport #675) LayeredCostmap::updateMap() and LayeredCostmap::resizeMap() write to the master grid costmap. And these two functions can be called by different threads at the same time. One example of these cases is a race condition between subscriber callback thread dealing with dynamically-size-changing static_layer and periodical updateMap() calls from Costmap2DROS thread. Under the situation the master grid costmap is not thread-safe. LayeredCostmap::updateMap() already used the master grid costmap\'s lock.
  • Merge pull request #692 from ros-planning/remove_got_footprint remove unused got_footprint_
  • Merge pull request #691 from ros-planning/rehash_620 initialize all costmap variables
  • Contributors: Jaeyoung Lee, Michael Ferguson

1.12.15 (2018-03-20)

  • Merge pull request #671 from ros-planning/email_update_indigo update maintainer email (indigo)
  • fix \'enable\' for static_layer with rolling window (#659) (#664)
  • Merge pull request #647 from aaronhoy/indigo_add_ahoy Add myself as a maintainer.
  • Contributors: Aaron Hoy, Jannik Abbenseth, Michael Ferguson

1.12.14 (2017-12-19)

  • don\'t update costs if inflation radius is zero
  • Speedup (~60%) inflation layer update (#525)
  • Fix CMakeLists + package.xmls (#548)
  • Contributors: Jorge Santos Sim

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
asr_ftc_local_planner github-asr-ros-asr_ftc_local_planner
asr_navfn github-asr-ros-asr_navfn
asr_robot_model_services github-asr-ros-asr_robot_model_services
cob_collision_velocity_filter github-ipa320-cob_control
cob_bringup github-ipa320-cob_robots
cob_hardware_config github-ipa320-cob_robots
costmap_converter github-rst-tu-dortmund-costmap_converter
eband_local_planner github-utexas-bwi-eband_local_planner
fetch_depth_layer github-fetchrobotics-fetch_ros
fetch_navigation github-fetchrobotics-fetch_ros
grid_map_costmap_2d github-anybotics-grid_map
base_local_planner github-ros-planning-navigation
carrot_planner github-ros-planning-navigation
clear_costmap_recovery github-ros-planning-navigation
dwa_local_planner github-ros-planning-navigation
global_planner github-ros-planning-navigation
move_base github-ros-planning-navigation
move_slow_and_clear github-ros-planning-navigation
nav_core github-ros-planning-navigation
navfn github-ros-planning-navigation
navigation github-ros-planning-navigation
rotate_recovery github-ros-planning-navigation
nav2d_operator github-skasperski-navigation_2d
assisted_teleop github-ros-planning-navigation_experimental
goal_passer github-ros-planning-navigation_experimental
pose_follower github-ros-planning-navigation_experimental
sbpl_lattice_planner github-ros-planning-navigation_experimental
sbpl_recovery github-ros-planning-navigation_experimental
twist_recovery github-ros-planning-navigation_experimental
range_sensor_layer github-DLu-navigation_layers
social_navigation_layers github-DLu-navigation_layers
nav_core_adapter github-locusrobotics-robot_navigation
rtabmap_ros github-introlab-rtabmap_ros
safe_teleop_base github-SharedAutonomyToolkit-shared_autonomy_manipulation
teb_local_planner github-rst-tu-dortmund-teb_local_planner
cost_map_demos github-stonier-cost_map
cost_map_ros github-stonier-cost_map
depth_sensor_pose github-mdrwiega-depth_nav_tools
nav_layer_from_points github-mdrwiega-depth_nav_tools
frontier_exploration github-paulbovbel-frontier_exploration
hector_exploration_planner github-tu-darmstadt-ros-pkg-hector_navigation
explorer github-aau-ros-aau_multi_robot
speak_and_wait_recovery github-jsk-ros-pkg-jsk_robot
update_move_base_parameter_recovery github-jsk-ros-pkg-jsk_robot
carl_navigation github-GT-RAIL-carl_navigation
stepback_and_steerturn_recovery github-CIR-KIT-steer_drive_ros
voronoi_planner github-frontw-voronoi_planner

Recent questions tagged costmap_2d at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.11.16
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-planning/navigation.git
VCS Type git
VCS Version hydro-devel
Last Updated 2015-05-01
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

This package provides an implementation of a 2D costmap that takes in sensor data from the world, builds a 2D or 3D occupancy grid of the data (depending on whether a voxel based implementation is used), and inflates costs in a 2D costmap based on the occupancy grid and a user specified inflation radius. This package also provides support for map_server based initialization of a costmap, rolling window based costmaps, and parameter based subscription to and configuration of sensor topics.

Additional Links

Maintainers

  • David V. Lu!!
  • Michael Ferguson

Authors

  • Eitan Marder-Eppstein
  • David V. Lu!!
  • Dave Hershberger
  • contradict gmail.com
README
No README found. See repository README.
CHANGELOG

Changelog for package costmap_2d

1.11.16 (2015-04-30)

  • update maintainer email
  • Contributors: Michael Ferguson

1.11.15 (2015-02-03)

  • Add ARCHIVE_DESTINATION for static builds
  • Contributors: Gary Servin

1.11.14 (2014-12-05)

  • added waitForTransform to bufferCloud to solve extrapolation into the future exception
  • deallocate costmap before reallocating
  • prevent div by zero in raytraceLine
  • only prefix sensor_frame when it\'s not empty
  • tf_prefix support in obstacle_layer
  • remove undefined function updateUsingPlugins
  • remove unused cell_data.h
  • numerous style fixes
  • Contributors: Andrzej Pronobis, David Lu, Jeremie Deray, Mani Monajjemi, Michael Ferguson, enriquefernandez

1.11.13 (2014-10-02)

1.11.12 (2014-10-01)

  • costmap_2d: export library layers
  • Merge pull request #198 from kmhallen/hydro-devel Fixed costmap_2d clearing from service /move_base/clear_costmaps
  • Costmap Layer comments
  • Add destructors for all of the layers to remove the dynamic parameter clients
  • Add method for removing static observations (for testing)
  • Move testing_helper
  • Initial Clearing Costmap parameter change
  • Fixed costmap_2d clearing from service /move_base/clear_costmaps
  • Contributors: David Lu!!, Kevin Hallenbeck, Michael Ferguson

1.11.11 (2014-07-23)

  • removes trailing spaces and empty lines
  • Contributors: Enrique Fern

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Recent questions tagged costmap_2d at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.14.9
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-planning/navigation.git
VCS Type git
VCS Version kinetic-devel
Last Updated 2021-01-19
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

This package provides an implementation of a 2D costmap that takes in sensor data from the world, builds a 2D or 3D occupancy grid of the data (depending on whether a voxel based implementation is used), and inflates costs in a 2D costmap based on the occupancy grid and a user specified inflation radius. This package also provides support for map_server based initialization of a costmap, rolling window based costmaps, and parameter based subscription to and configuration of sensor topics.

Additional Links

Maintainers

  • David V. Lu!!
  • Michael Ferguson
  • Aaron Hoy

Authors

  • Eitan Marder-Eppstein
  • David V. Lu!!
  • Dave Hershberger
  • contradict gmail.com
README
No README found. See repository README.
CHANGELOG

Changelog for package costmap_2d

1.14.9 (2021-01-05)

1.14.8 (2020-08-27)

1.14.7 (2020-03-10)

  • fix usage of size_locked, fixes #959 (#966) (#972)
  • Contributors: Michael Ferguson

1.14.6 (2020-03-04)

1.14.5 (2019-11-15)

  • Changed logic for when to resize layered costmap in static layer (#792) * Changed logic for when to resize layered costmap in static layer -Now the master layered costmap should no longer get resized when isSizeLocked returns true

    • Fixing format for if loop
  • [kinetic] Fix Bounds Bug (plus test) (#871)

    • fix map bounds bug
    • Add test
  • Remove twice calculation of time_diff (#863)

  • Merge pull request #841 from DLu/feature/fix_install [kinetic] Fix install

  • Fix install

  • Add additional linked libraries (#800)

  • Contributors: David V. Lu, David V. Lu!!, Michael Ferguson, Stepan Kostusiev

1.14.4 (2018-06-19)

  • Merge pull request #693 from ros-planning/kinetic_691 costmap variable init & cleanup (forward port of #691)
  • remove unused got_footprint_
  • initialize all costmap variables
  • Merge pull request #675 from stereoboy/kinetic-devel_jylee Fixed race condition with costmaps in LayeredCostmap::resizeMap() LayeredCostmap::updateMap() and LayeredCostmap::resizeMap() write to the master grid costmap. And these two functions can be called by different threads at the same time. One example of these cases is a race condition between subscriber callback thread dealing with dynamically-size-changing static_layer and periodical updateMap() calls from Costmap2DROS thread. Under the situation the master grid costmap is not thread-safe. LayeredCostmap::updateMap() already used the master grid costmap\'s lock.
  • Contributors: Jaeyoung Lee, Michael Ferguson

1.14.3 (2018-03-16)

  • Merge pull request #672 from ros-planning/email_update_kinetic update maintainer email (kinetic)
  • Fixes #206 for kinetic (#663)
    • Fixes #206 for kinetic
  • fix \'enable\' for static_layer with rolling window (#659)
  • Merge pull request #648 from aaronhoy/kinetic_add_ahoy Add myself as a maintainer.
  • Contributors: Aaron Hoy, David V. Lu!!, Jannik Abbenseth, Michael Ferguson

1.14.2 (2017-08-14)

1.14.1 (2017-08-07)

  • Added parameter for allowing inflation in unknown cells (#564)
  • don\'t update costs if inflation radius is zero
  • Speedup (~60%) inflation layer update (#525)
  • Fix CMakeLists + package.xmls (#548)
  • Added deps to amcl costmap_2d move_base (#512)
  • remove GCC warnings
  • Fix CMake warnings
  • renamed targets for message generation (gencpp -> generate_messages_cpp) in order to avoid warnings for non-existing target dependencies
  • Fixed race condition with costmaps
  • Merge pull request #491 from alexhenning/kinetic-inflation-fix
  • Fixed sign error in inflation layer
  • Adds warning when a layer shrinks the bounds
  • Fixed bug with inflation layer that caused underinflation
  • Fixed bug with artifacts when not current
  • Fix bug with inflation artifacts being left behind
  • Fixes issue with costmaps shearing
  • Made costmap publishing truly lazy
  • Contributors: Alex Henning, Hidde Wieringa, Jorge Santos Sim

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
asr_ftc_local_planner github-asr-ros-asr_ftc_local_planner
asr_navfn github-asr-ros-asr_navfn
asr_robot_model_services github-asr-ros-asr_robot_model_services
cob_collision_velocity_filter github-ipa320-cob_control
cob_bringup github-ipa320-cob_robots
cob_hardware_config github-ipa320-cob_robots
costmap_converter github-rst-tu-dortmund-costmap_converter
distance_map_core github-artivis-distance_map
eband_local_planner github-utexas-bwi-eband_local_planner
fetch_depth_layer github-fetchrobotics-fetch_ros
fetch_navigation github-fetchrobotics-fetch_ros
grid_map_costmap_2d github-anybotics-grid_map
explore_lite github-hrnr-m-explore
mbf_costmap_core github-magazino-move_base_flex
mbf_costmap_nav github-magazino-move_base_flex
base_local_planner github-ros-planning-navigation
carrot_planner github-ros-planning-navigation
clear_costmap_recovery github-ros-planning-navigation
dwa_local_planner github-ros-planning-navigation
global_planner github-ros-planning-navigation
move_base github-ros-planning-navigation
move_slow_and_clear github-ros-planning-navigation
nav_core github-ros-planning-navigation
navfn github-ros-planning-navigation
navigation github-ros-planning-navigation
rotate_recovery github-ros-planning-navigation
nav2d_operator github-skasperski-navigation_2d
assisted_teleop github-ros-planning-navigation_experimental
goal_passer github-ros-planning-navigation_experimental
pose_follower github-ros-planning-navigation_experimental
sbpl_lattice_planner github-ros-planning-navigation_experimental
sbpl_recovery github-ros-planning-navigation_experimental
twist_recovery github-ros-planning-navigation_experimental
range_sensor_layer github-DLu-navigation_layers
social_navigation_layers github-DLu-navigation_layers
nonpersistent_voxel_layer github-SteveMacenski-nonpersistent_voxel_layer
pipeline_planner github-SeaosRobotics-pipeline_planner_open
nav_core_adapter github-locusrobotics-robot_navigation
rtabmap_ros github-introlab-rtabmap_ros
safe_teleop_base github-SharedAutonomyToolkit-shared_autonomy_manipulation
spatio_temporal_voxel_layer github-SteveMacenski-spatio_temporal_voxel_layer
teb_local_planner github-rst-tu-dortmund-teb_local_planner
yocs_navi_toolkit github-yujinrobot-yujin_ocs
cost_map_demos github-stonier-cost_map
cost_map_ros github-stonier-cost_map
costmap_prohibition_layer github-rst-tu-dortmund-costmap_prohibition_layer
depth_sensor_pose github-mdrwiega-depth_nav_tools
nav_layer_from_points github-mdrwiega-depth_nav_tools
frontier_exploration github-paulbovbel-frontier_exploration
hector_exploration_planner github-tu-darmstadt-ros-pkg-hector_navigation
smp_ros github-ksatyaki-smp_ros
addwa_local_planner github-bluewhalerobot-xiaoqiang

Recent questions tagged costmap_2d at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.16.7
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros-planning/navigation.git
VCS Type git
VCS Version melodic-devel
Last Updated 2022-06-20
Dev Status MAINTAINED
CI status
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

This package provides an implementation of a 2D costmap that takes in sensor data from the world, builds a 2D or 3D occupancy grid of the data (depending on whether a voxel based implementation is used), and inflates costs in a 2D costmap based on the occupancy grid and a user specified inflation radius. This package also provides support for map_server based initialization of a costmap, rolling window based costmaps, and parameter based subscription to and configuration of sensor topics.

Additional Links

Maintainers

  • David V. Lu!!
  • Michael Ferguson
  • Aaron Hoy

Authors

  • Eitan Marder-Eppstein
  • David V. Lu!!
  • Dave Hershberger
  • contradict gmail.com
README
No README found. See repository README.
CHANGELOG

Changelog for package costmap_2d

1.16.7 (2020-08-27)

  • add explicit call to ros::Timer::stop in the destructor (#984) Co-authored-by: Dima Dorezyuk <dorezyuk@magazino.eu>
  • backport noetic memory fixes (#983) spent some time with valgrind to fix this test, was failing intermittently in melodic, all the time in noetic.
  • Contributors: Dima Dorezyuk, Michael Ferguson

1.16.6 (2020-03-18)

1.16.5 (2020-03-15)

  • [melodic] updated install for better portability. (#973)
  • Contributors: Sean Yen

1.16.4 (2020-03-04)

  • fix published footprint topic name (#947) The default name of the topic will be updated in noetic
  • fix usage of size_locked, fixes #959 (#966)
  • [Windows][melodic] Navigation (except for map_server and amcl) Windows build bring up (#851)
  • Merge pull request #957 from Blindnology/melodic-updateOrigin Optimize costmap_2d::updateOrigin
  • Optimize costmap_2d::updateOrigin
  • Contributors: Michael Ferguson, Pavlo Kolomiiets, Sean Yen, Yuki Furuta

1.16.3 (2019-11-15)

  • Merge pull request #877 from SteveMacenski/layer_clear_area-melodic [melodic] moving clearing area method to costmap_layer so other applications can clear other types.
  • Merge branch \'melodic-devel\' into layer_clear_area-melodic
  • Drop Parameter Magic (#893)
  • Fixes #782 (#892)
  • Costmap_2d plugin universal parameters and pre-hydro warnings (#738)
    • Comment and description clarification
    • Renamed resetOldParameters to loadOldParameters
    • Upscaled pre-hydro parameter info message to warning and added costmap-name
    • Warn user when static_map or map_type is set but not used while plugins are used
    • Added function that copies parent parameters inside each layer (makes it possible to set a global inflation_radius)
    • use parameter magic
  • Changed logic for when to resize layered costmap in static layer (#792) * Changed logic for when to resize layered costmap in static layer -Now the master layered costmap should no longer get resized when isSizeLocked returns true

    • Fixing format for if loop
  • clear area in layer for melodic

  • [kinetic] Fix Bounds Bug (plus test) (#871) (#875)

    • fix map bounds bug
    • Add test
  • Fix install (#855)

  • Add additional linked libraries (#803)

  • Contributors: David V. Lu!!, Martin Ganeff, Michael Ferguson, Steven Macenski, stevemacenski

1.16.2 (2018-07-31)

  • Merge pull request #773 from ros-planning/packaging_fixes packaging fixes
  • update costmap_2d cmake
    • explicit dependency on tf2
    • remove old PCL disable crap
  • Contributors: Michael Ferguson

1.16.1 (2018-07-28)

  • Merge pull request #770 from ros-planning/fix_debians Fix debian builds (closes #769)
  • add tf2_geometry_msgs depend to costmap_2d
  • Contributors: Michael Ferguson

1.16.0 (2018-07-25)

  • Switch to TF2 #755
  • unify combination_method dynamic reconfig, closes #402
  • Merge pull request #723 from moriarty/melodic-buildfarm-errors Melodic buildfarm errors
  • [costmap_2d/test] set empty transform to Identity
  • fix test: abs(unsigned int) is ambiguous Instead, compare values and subtract smaller from larger to find the dx and dy.
  • fixes pluginlib deprecated header warnings
  • Merge pull request #694 from ros-planning/lunar_691 costmap variable init & cleanup (forward port of #691)
  • remove unused got_footprint_
  • initialize all costmap variables
  • Merge pull request #686 from ros-planning/lunar_675 Fixed race condition with costmaps in LayeredCostmap::resizeMap()
  • Fixed race condition with costmaps in LayeredCostmap::resizeMap() LayeredCostmap::updateMap() and LayeredCostmap::resizeMap() write to the master grid costmap. And these two functions can be called by different threads at the same time. One example of these cases is a race condition between subscriber callback thread dealing with dynamically-size-changing static_layer and periodical updateMap() calls from Costmap2DROS thread. Under the situation the master grid costmap is not thread-safe. LayeredCostmap::updateMap() already used the master grid costmap\'s lock.
  • Contributors: Alexander Moriarty, David V. Lu, Jaeyoung Lee, Michael Ferguson, Vincent Rabaud

1.15.2 (2018-03-22)

  • Merge pull request #673 from ros-planning/email_update_lunar update maintainer email (lunar)
  • Merge pull request #670 from DLu/fix206_lunar Fixes #206 for Lunar
  • fix \'enable\' for static_layer with rolling window (#659) (#665)
  • Merge pull request #649 from aaronhoy/lunar_add_ahoy Add myself as a maintainer.
  • Contributors: Aaron Hoy, David V. Lu!!, Jannik Abbenseth, Michael Ferguson

1.15.1 (2017-08-14)

1.15.0 (2017-08-07)

  • Added parameter for allowing inflation in unknown cells (#564)
  • Inflation Layer protected members and virtual computeCost [ABI BREAKING]
  • Fix for #517: create a getRobotPose method on move_base instead of using that on the costmaps
  • don\'t update costs if inflation radius is zero
  • rebase fixups
  • convert packages to format2
  • Speedup (~60%) inflation layer update (#525)
  • 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)
  • Added deps to amcl costmap_2d move_base (#512)
  • remove GCC warnings
  • Fix CMake warnings
  • renamed targets for message generation (gencpp -> generate_messages_cpp) in order to avoid warnings for non-existing target dependencies
  • Fixed race condition with costmaps
  • Merge pull request #491 from alexhenning/kinetic-inflation-fix
  • Fixed sign error in inflation layer
  • Adds warning when a layer shrinks the bounds
  • Fixed bug with inflation layer that caused underinflation
  • Fixed bug with artifacts when not current
  • Fix bug with inflation artifacts being left behind
  • Fixes issue with costmaps shearing
  • Made costmap publishing truly lazy
  • Contributors: Alex Henning, Alexander Reimann, Hidde Wieringa, Jorge Santos, Jorge Santos Sim

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Dependant Packages

Name Repo Deps
asr_ftc_local_planner github-asr-ros-asr_ftc_local_planner
asr_navfn github-asr-ros-asr_navfn
asr_robot_model_services github-asr-ros-asr_robot_model_services
cob_collision_velocity_filter github-ipa320-cob_control
cob_bringup github-ipa320-cob_robots
cob_hardware_config github-ipa320-cob_robots
costmap_converter github-rst-tu-dortmund-costmap_converter
costmap_tf_layer github-igorbanfi-costmap_tf_layer
distance_map_core github-artivis-distance_map
eband_local_planner github-utexas-bwi-eband_local_planner
fetch_depth_layer github-fetchrobotics-fetch_ros
fetch_navigation github-fetchrobotics-fetch_ros
graceful_controller_ros github-mikeferguson-graceful_controller
grid_map_costmap_2d github-anybotics-grid_map
explore_lite github-hrnr-m-explore
moveback_recovery github-uos-mbf_recovery_behaviors
mbf_costmap_core github-magazino-move_base_flex
mbf_costmap_nav github-magazino-move_base_flex
move_base_swp github-ihadzic-move_base_swp
mpc_local_planner github-rst-tu-dortmund-mpc_local_planner
base_local_planner github-ros-planning-navigation
carrot_planner github-ros-planning-navigation
clear_costmap_recovery github-ros-planning-navigation
dwa_local_planner github-ros-planning-navigation
global_planner github-ros-planning-navigation
move_base github-ros-planning-navigation
move_slow_and_clear github-ros-planning-navigation
nav_core github-ros-planning-navigation
navfn github-ros-planning-navigation
navigation github-ros-planning-navigation
rotate_recovery github-ros-planning-navigation
nav2d_operator github-skasperski-navigation_2d
assisted_teleop github-ros-planning-navigation_experimental
goal_passer github-ros-planning-navigation_experimental
pose_follower github-ros-planning-navigation_experimental
sbpl_lattice_planner github-ros-planning-navigation_experimental
sbpl_recovery github-ros-planning-navigation_experimental
twist_recovery github-ros-planning-navigation_experimental
range_sensor_layer github-DLu-navigation_layers
social_navigation_layers github-DLu-navigation_layers
neo_local_planner github-neobotix-neo_local_planner
nonpersistent_voxel_layer github-SteveMacenski-nonpersistent_voxel_layer
pipeline_planner github-SeaosRobotics-pipeline_planner_open
nav_core_adapter github-locusrobotics-robot_navigation
rtabmap_ros github-introlab-rtabmap_ros
safe_teleop_base github-SharedAutonomyToolkit-shared_autonomy_manipulation
backward_global_planner github-robosoft-ai-smacc
backward_local_planner github-robosoft-ai-smacc
forward_global_planner github-robosoft-ai-smacc
forward_local_planner github-robosoft-ai-smacc
pure_spinning_local_planner github-robosoft-ai-smacc
undo_path_global_planner github-robosoft-ai-smacc
spatio_temporal_voxel_layer github-SteveMacenski-spatio_temporal_voxel_layer
steering_functions github-hbanzhaf-steering_functions
teb_local_planner github-rst-tu-dortmund-teb_local_planner
yocs_navi_toolkit github-yujinrobot-yujin_ocs

Recent questions tagged costmap_2d at Robotics Stack Exchange