![]() |
planner_cspace package from neonavigation repocostmap_cspace joystick_interrupt map_organizer neonavigation neonavigation_common neonavigation_launch obj_to_pointcloud planner_cspace safety_limiter track_odometry trajectory_tracker |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.18.1 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/at-wat/neonavigation.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2025-06-20 |
Dev Status | DEVELOPED |
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
Additional Links
Maintainers
- Atsushi Watanabe
Authors
- Atsushi Watanabe
planner_cspace package
The topic names will be migrated to ROS recommended namespace model.
Set /neonavigation_compatible
parameter to 1
to use new topic names.
planner_3d
planner_3d node provides 2-D/3-DOF seamless global-local path and motion planner.
Subscribed topics
- ~/costmap (new: costmap) [costmap_cspace_msgs::CSpace3D]
- ~/costmap_update (new: costmap_update) [costmap_cspace_msgs::CSpace3DUpdate]
- ~/goal (new: move_base_simple/goal) [geometry_msgs::PoseStamped]
- /tf
Published topics
- ~/path (new: path) [nav_msgs::Path]
- ~/debug [sensor_msgs::PointCloud]
debug output of planner internal costmap
- ~/remembered [sensor_msgs::PointCloud]
debug output of obstacles probability estimated by BBF
- ~/path_start [geometry_msgs::PoseStamped]
- ~/path_end [geometry_msgs::PoseStamped]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
- ~/forget (new: forget_planning_cost) [std_srvs::Empty]
Called services
Parameters
- “goal_tolerance_lin” (double, default: 0.05)
- “goal_tolerance_ang” (double, default: 0.1)
- “goal_tolerance_ang_finish” (double, default: 0.05)
- “unknown_cost” (int, default: 100)
- “hist_cnt_max” (int, default: 20)
- “hist_cnt_thres” (int, default: 19)
- “hist_cost” (int, default: 90)
- “hist_ignore_range” (double, default: 1.0)
- “remember_updates” (bool, default: false)
- “local_range” (double, default: 2.5)
- “longcut_range” (double, default: 0.0)
- “esc_range” (double, default: 0.25)
- “find_best” (bool, default: true)
- “pos_jump” (double, default: 1.0)
- “yaw_jump” (double, default: 1.5)
- “jump_detect_frame” (string, default: base_link)
- “force_goal_orientation” (bool, default: true)
- “temporary_escape” (bool, default: true)
- “fast_map_update” (bool, default: false)
- “debug_mode” (string, default: std::string(“cost_estim”))
debug output data type
- “hyst”: path hysteresis cost
- “cost_estim”: estimated cost to the goal used as A* heuristic function
- “queue_size_limit” (int, default: 0)
- “antialias_start” (bool, default: false)
If enabled, the planner searches path from multiple surrounding grids within the grid size to reduce path chattering.
planner_2dof_serial_joints
planner_2dof_serial_joints provides collision avoidance for 2-DOF serial joint (e.g. controlling interfering pairs of sub-tracks for tracked vehicle.)
Subscribed topics
- ~/trajectory_in (new: trajectory_in) [trajectory_msgs::JointTrajectory]
- ~/joint (new: joint_states) [sensor_msgs::JointState]
- /tf
Published topics
- ~/trajectory_out (new: joint_trajectory) [trajectory_msgs::JointTrajectory]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
Called services
Parameters
- “resolution” (int, default: 128)
- “debug_aa” (bool, default: false)
- “replan_interval” (double, default: 0.2)
- “queue_size_limit” (int, default: 0)
- “link0_name” (string, default: std::string(“link0”))
- “link1_name” (string, default: std::string(“link1”))
- “point_vel_mode” (string, default: std::string(“prev”))
- “range” (int, default: 8)
- “num_groups” (int, default: 1)
File truncated at 100 lines see the full file
Changelog for package planner_cspace
0.18.1 (2025-06-06)
- planner_cspace: fix crowd escape to use original goal if reachable (#779)
- planner_cspace: fix error status during crowd escape (#776)
- Contributors: Atsushi Watanabe
0.18.0 (2025-05-13)
- Ignore temporary escape trigger if map is not received (#770)
- planner_cspace: crowd escape mode (#763)
- planner_cspace: fix flaky navigation tests (#768)
- Contributors: Atsushi Watanabe
0.17.7 (2025-04-16)
0.17.6 (2025-03-18)
- planner_cspace: fix flaky dynamic reconfigure test (#756)
- Contributors: Atsushi Watanabe
0.17.5 (2025-02-21)
- planner_cspace: reconstuct GridAstarModel3D only when necessary (#751)
- Contributors: Naotaka Hatao
0.17.4 (2025-01-20)
0.17.3 (2024-12-25)
- planner_cspace: add costmap_cspace integration test for out-of-bound position (#746)
- costmap_cspace: publish empty costmap_update on out-of-bound (#743)
- planner_cspace: reduce remember_updates calculation cost (#742)
- Contributors: Atsushi Watanabe
0.17.2 (2024-11-07)
- planner_3d: apply turn_penalty_cost_threshold in curve path (#739)
- Contributors: Naotaka Hatao
0.17.1 (2024-03-22)
- planner_3d: remove duplicated interpolation method (#733)
- Contributors: Naotaka Hatao
0.17.0 (2023-11-02)
- planner_3d: add an option to trigger planning by costmap updates (#727)
- planner_3d: fix cost calculation bug on in-place turning (#725)
- Contributors: Naotaka Hatao
0.16.0 (2023-09-14)
- planner_cspace: start planning from expected robot pose (#717)
- planner_cspace: add new parameters for cost function (#720)
- planner_cspace: refactor start pose building algorithm and fix finishing condition when start is relocated (#718)
- Contributors: Naotaka Hatao
0.15.0 (2023-08-30)
- planner_cspace: enable dynamic reconfigure (#714)
- planner_space: fix segmentation fault on out-of-map (#712)
- Contributors: Atsushi Watanabe, Naotaka Hatao
0.14.2 (2023-07-31)
- planner_cspace: improve peformance of DistanceMap (#709)
- planner_cspace: avoid multiple goal pose relocation (#708)
- Contributors: Naotaka Hatao
0.14.1 (2023-07-07)
- planner_cspace: fix error status handling after cost_estim_cache_ was not created (#705)
- Contributors: Naotaka Hatao
File truncated at 100 lines see the full file
Wiki Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
neonavigation | |
neonavigation_launch |
Launch files
Messages
Services
Plugins
Recent questions tagged planner_cspace at Robotics Stack Exchange
![]() |
planner_cspace package from neonavigation repocostmap_cspace joystick_interrupt map_organizer neonavigation neonavigation_common neonavigation_launch obj_to_pointcloud planner_cspace safety_limiter track_odometry trajectory_tracker |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.18.1 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/at-wat/neonavigation.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2025-06-20 |
Dev Status | DEVELOPED |
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
Additional Links
Maintainers
- Atsushi Watanabe
Authors
- Atsushi Watanabe
planner_cspace package
The topic names will be migrated to ROS recommended namespace model.
Set /neonavigation_compatible
parameter to 1
to use new topic names.
planner_3d
planner_3d node provides 2-D/3-DOF seamless global-local path and motion planner.
Subscribed topics
- ~/costmap (new: costmap) [costmap_cspace_msgs::CSpace3D]
- ~/costmap_update (new: costmap_update) [costmap_cspace_msgs::CSpace3DUpdate]
- ~/goal (new: move_base_simple/goal) [geometry_msgs::PoseStamped]
- /tf
Published topics
- ~/path (new: path) [nav_msgs::Path]
- ~/debug [sensor_msgs::PointCloud]
debug output of planner internal costmap
- ~/remembered [sensor_msgs::PointCloud]
debug output of obstacles probability estimated by BBF
- ~/path_start [geometry_msgs::PoseStamped]
- ~/path_end [geometry_msgs::PoseStamped]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
- ~/forget (new: forget_planning_cost) [std_srvs::Empty]
Called services
Parameters
- “goal_tolerance_lin” (double, default: 0.05)
- “goal_tolerance_ang” (double, default: 0.1)
- “goal_tolerance_ang_finish” (double, default: 0.05)
- “unknown_cost” (int, default: 100)
- “hist_cnt_max” (int, default: 20)
- “hist_cnt_thres” (int, default: 19)
- “hist_cost” (int, default: 90)
- “hist_ignore_range” (double, default: 1.0)
- “remember_updates” (bool, default: false)
- “local_range” (double, default: 2.5)
- “longcut_range” (double, default: 0.0)
- “esc_range” (double, default: 0.25)
- “find_best” (bool, default: true)
- “pos_jump” (double, default: 1.0)
- “yaw_jump” (double, default: 1.5)
- “jump_detect_frame” (string, default: base_link)
- “force_goal_orientation” (bool, default: true)
- “temporary_escape” (bool, default: true)
- “fast_map_update” (bool, default: false)
- “debug_mode” (string, default: std::string(“cost_estim”))
debug output data type
- “hyst”: path hysteresis cost
- “cost_estim”: estimated cost to the goal used as A* heuristic function
- “queue_size_limit” (int, default: 0)
- “antialias_start” (bool, default: false)
If enabled, the planner searches path from multiple surrounding grids within the grid size to reduce path chattering.
planner_2dof_serial_joints
planner_2dof_serial_joints provides collision avoidance for 2-DOF serial joint (e.g. controlling interfering pairs of sub-tracks for tracked vehicle.)
Subscribed topics
- ~/trajectory_in (new: trajectory_in) [trajectory_msgs::JointTrajectory]
- ~/joint (new: joint_states) [sensor_msgs::JointState]
- /tf
Published topics
- ~/trajectory_out (new: joint_trajectory) [trajectory_msgs::JointTrajectory]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
Called services
Parameters
- “resolution” (int, default: 128)
- “debug_aa” (bool, default: false)
- “replan_interval” (double, default: 0.2)
- “queue_size_limit” (int, default: 0)
- “link0_name” (string, default: std::string(“link0”))
- “link1_name” (string, default: std::string(“link1”))
- “point_vel_mode” (string, default: std::string(“prev”))
- “range” (int, default: 8)
- “num_groups” (int, default: 1)
File truncated at 100 lines see the full file
Changelog for package planner_cspace
0.18.1 (2025-06-06)
- planner_cspace: fix crowd escape to use original goal if reachable (#779)
- planner_cspace: fix error status during crowd escape (#776)
- Contributors: Atsushi Watanabe
0.18.0 (2025-05-13)
- Ignore temporary escape trigger if map is not received (#770)
- planner_cspace: crowd escape mode (#763)
- planner_cspace: fix flaky navigation tests (#768)
- Contributors: Atsushi Watanabe
0.17.7 (2025-04-16)
0.17.6 (2025-03-18)
- planner_cspace: fix flaky dynamic reconfigure test (#756)
- Contributors: Atsushi Watanabe
0.17.5 (2025-02-21)
- planner_cspace: reconstuct GridAstarModel3D only when necessary (#751)
- Contributors: Naotaka Hatao
0.17.4 (2025-01-20)
0.17.3 (2024-12-25)
- planner_cspace: add costmap_cspace integration test for out-of-bound position (#746)
- costmap_cspace: publish empty costmap_update on out-of-bound (#743)
- planner_cspace: reduce remember_updates calculation cost (#742)
- Contributors: Atsushi Watanabe
0.17.2 (2024-11-07)
- planner_3d: apply turn_penalty_cost_threshold in curve path (#739)
- Contributors: Naotaka Hatao
0.17.1 (2024-03-22)
- planner_3d: remove duplicated interpolation method (#733)
- Contributors: Naotaka Hatao
0.17.0 (2023-11-02)
- planner_3d: add an option to trigger planning by costmap updates (#727)
- planner_3d: fix cost calculation bug on in-place turning (#725)
- Contributors: Naotaka Hatao
0.16.0 (2023-09-14)
- planner_cspace: start planning from expected robot pose (#717)
- planner_cspace: add new parameters for cost function (#720)
- planner_cspace: refactor start pose building algorithm and fix finishing condition when start is relocated (#718)
- Contributors: Naotaka Hatao
0.15.0 (2023-08-30)
- planner_cspace: enable dynamic reconfigure (#714)
- planner_space: fix segmentation fault on out-of-map (#712)
- Contributors: Atsushi Watanabe, Naotaka Hatao
0.14.2 (2023-07-31)
- planner_cspace: improve peformance of DistanceMap (#709)
- planner_cspace: avoid multiple goal pose relocation (#708)
- Contributors: Naotaka Hatao
0.14.1 (2023-07-07)
- planner_cspace: fix error status handling after cost_estim_cache_ was not created (#705)
- Contributors: Naotaka Hatao
File truncated at 100 lines see the full file
Wiki Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
neonavigation | |
neonavigation_launch |
Launch files
Messages
Services
Plugins
Recent questions tagged planner_cspace at Robotics Stack Exchange
![]() |
planner_cspace package from neonavigation repocostmap_cspace joystick_interrupt map_organizer neonavigation neonavigation_common neonavigation_launch obj_to_pointcloud planner_cspace safety_limiter track_odometry trajectory_tracker |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.18.1 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/at-wat/neonavigation.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2025-06-20 |
Dev Status | DEVELOPED |
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
Additional Links
Maintainers
- Atsushi Watanabe
Authors
- Atsushi Watanabe
planner_cspace package
The topic names will be migrated to ROS recommended namespace model.
Set /neonavigation_compatible
parameter to 1
to use new topic names.
planner_3d
planner_3d node provides 2-D/3-DOF seamless global-local path and motion planner.
Subscribed topics
- ~/costmap (new: costmap) [costmap_cspace_msgs::CSpace3D]
- ~/costmap_update (new: costmap_update) [costmap_cspace_msgs::CSpace3DUpdate]
- ~/goal (new: move_base_simple/goal) [geometry_msgs::PoseStamped]
- /tf
Published topics
- ~/path (new: path) [nav_msgs::Path]
- ~/debug [sensor_msgs::PointCloud]
debug output of planner internal costmap
- ~/remembered [sensor_msgs::PointCloud]
debug output of obstacles probability estimated by BBF
- ~/path_start [geometry_msgs::PoseStamped]
- ~/path_end [geometry_msgs::PoseStamped]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
- ~/forget (new: forget_planning_cost) [std_srvs::Empty]
Called services
Parameters
- “goal_tolerance_lin” (double, default: 0.05)
- “goal_tolerance_ang” (double, default: 0.1)
- “goal_tolerance_ang_finish” (double, default: 0.05)
- “unknown_cost” (int, default: 100)
- “hist_cnt_max” (int, default: 20)
- “hist_cnt_thres” (int, default: 19)
- “hist_cost” (int, default: 90)
- “hist_ignore_range” (double, default: 1.0)
- “remember_updates” (bool, default: false)
- “local_range” (double, default: 2.5)
- “longcut_range” (double, default: 0.0)
- “esc_range” (double, default: 0.25)
- “find_best” (bool, default: true)
- “pos_jump” (double, default: 1.0)
- “yaw_jump” (double, default: 1.5)
- “jump_detect_frame” (string, default: base_link)
- “force_goal_orientation” (bool, default: true)
- “temporary_escape” (bool, default: true)
- “fast_map_update” (bool, default: false)
- “debug_mode” (string, default: std::string(“cost_estim”))
debug output data type
- “hyst”: path hysteresis cost
- “cost_estim”: estimated cost to the goal used as A* heuristic function
- “queue_size_limit” (int, default: 0)
- “antialias_start” (bool, default: false)
If enabled, the planner searches path from multiple surrounding grids within the grid size to reduce path chattering.
planner_2dof_serial_joints
planner_2dof_serial_joints provides collision avoidance for 2-DOF serial joint (e.g. controlling interfering pairs of sub-tracks for tracked vehicle.)
Subscribed topics
- ~/trajectory_in (new: trajectory_in) [trajectory_msgs::JointTrajectory]
- ~/joint (new: joint_states) [sensor_msgs::JointState]
- /tf
Published topics
- ~/trajectory_out (new: joint_trajectory) [trajectory_msgs::JointTrajectory]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
Called services
Parameters
- “resolution” (int, default: 128)
- “debug_aa” (bool, default: false)
- “replan_interval” (double, default: 0.2)
- “queue_size_limit” (int, default: 0)
- “link0_name” (string, default: std::string(“link0”))
- “link1_name” (string, default: std::string(“link1”))
- “point_vel_mode” (string, default: std::string(“prev”))
- “range” (int, default: 8)
- “num_groups” (int, default: 1)
File truncated at 100 lines see the full file
Changelog for package planner_cspace
0.18.1 (2025-06-06)
- planner_cspace: fix crowd escape to use original goal if reachable (#779)
- planner_cspace: fix error status during crowd escape (#776)
- Contributors: Atsushi Watanabe
0.18.0 (2025-05-13)
- Ignore temporary escape trigger if map is not received (#770)
- planner_cspace: crowd escape mode (#763)
- planner_cspace: fix flaky navigation tests (#768)
- Contributors: Atsushi Watanabe
0.17.7 (2025-04-16)
0.17.6 (2025-03-18)
- planner_cspace: fix flaky dynamic reconfigure test (#756)
- Contributors: Atsushi Watanabe
0.17.5 (2025-02-21)
- planner_cspace: reconstuct GridAstarModel3D only when necessary (#751)
- Contributors: Naotaka Hatao
0.17.4 (2025-01-20)
0.17.3 (2024-12-25)
- planner_cspace: add costmap_cspace integration test for out-of-bound position (#746)
- costmap_cspace: publish empty costmap_update on out-of-bound (#743)
- planner_cspace: reduce remember_updates calculation cost (#742)
- Contributors: Atsushi Watanabe
0.17.2 (2024-11-07)
- planner_3d: apply turn_penalty_cost_threshold in curve path (#739)
- Contributors: Naotaka Hatao
0.17.1 (2024-03-22)
- planner_3d: remove duplicated interpolation method (#733)
- Contributors: Naotaka Hatao
0.17.0 (2023-11-02)
- planner_3d: add an option to trigger planning by costmap updates (#727)
- planner_3d: fix cost calculation bug on in-place turning (#725)
- Contributors: Naotaka Hatao
0.16.0 (2023-09-14)
- planner_cspace: start planning from expected robot pose (#717)
- planner_cspace: add new parameters for cost function (#720)
- planner_cspace: refactor start pose building algorithm and fix finishing condition when start is relocated (#718)
- Contributors: Naotaka Hatao
0.15.0 (2023-08-30)
- planner_cspace: enable dynamic reconfigure (#714)
- planner_space: fix segmentation fault on out-of-map (#712)
- Contributors: Atsushi Watanabe, Naotaka Hatao
0.14.2 (2023-07-31)
- planner_cspace: improve peformance of DistanceMap (#709)
- planner_cspace: avoid multiple goal pose relocation (#708)
- Contributors: Naotaka Hatao
0.14.1 (2023-07-07)
- planner_cspace: fix error status handling after cost_estim_cache_ was not created (#705)
- Contributors: Naotaka Hatao
File truncated at 100 lines see the full file
Wiki Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
neonavigation | |
neonavigation_launch |
Launch files
Messages
Services
Plugins
Recent questions tagged planner_cspace at Robotics Stack Exchange
![]() |
planner_cspace package from neonavigation repocostmap_cspace joystick_interrupt map_organizer neonavigation neonavigation_common neonavigation_launch obj_to_pointcloud planner_cspace safety_limiter track_odometry trajectory_tracker |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.18.1 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/at-wat/neonavigation.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2025-06-20 |
Dev Status | DEVELOPED |
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
Additional Links
Maintainers
- Atsushi Watanabe
Authors
- Atsushi Watanabe
planner_cspace package
The topic names will be migrated to ROS recommended namespace model.
Set /neonavigation_compatible
parameter to 1
to use new topic names.
planner_3d
planner_3d node provides 2-D/3-DOF seamless global-local path and motion planner.
Subscribed topics
- ~/costmap (new: costmap) [costmap_cspace_msgs::CSpace3D]
- ~/costmap_update (new: costmap_update) [costmap_cspace_msgs::CSpace3DUpdate]
- ~/goal (new: move_base_simple/goal) [geometry_msgs::PoseStamped]
- /tf
Published topics
- ~/path (new: path) [nav_msgs::Path]
- ~/debug [sensor_msgs::PointCloud]
debug output of planner internal costmap
- ~/remembered [sensor_msgs::PointCloud]
debug output of obstacles probability estimated by BBF
- ~/path_start [geometry_msgs::PoseStamped]
- ~/path_end [geometry_msgs::PoseStamped]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
- ~/forget (new: forget_planning_cost) [std_srvs::Empty]
Called services
Parameters
- “goal_tolerance_lin” (double, default: 0.05)
- “goal_tolerance_ang” (double, default: 0.1)
- “goal_tolerance_ang_finish” (double, default: 0.05)
- “unknown_cost” (int, default: 100)
- “hist_cnt_max” (int, default: 20)
- “hist_cnt_thres” (int, default: 19)
- “hist_cost” (int, default: 90)
- “hist_ignore_range” (double, default: 1.0)
- “remember_updates” (bool, default: false)
- “local_range” (double, default: 2.5)
- “longcut_range” (double, default: 0.0)
- “esc_range” (double, default: 0.25)
- “find_best” (bool, default: true)
- “pos_jump” (double, default: 1.0)
- “yaw_jump” (double, default: 1.5)
- “jump_detect_frame” (string, default: base_link)
- “force_goal_orientation” (bool, default: true)
- “temporary_escape” (bool, default: true)
- “fast_map_update” (bool, default: false)
- “debug_mode” (string, default: std::string(“cost_estim”))
debug output data type
- “hyst”: path hysteresis cost
- “cost_estim”: estimated cost to the goal used as A* heuristic function
- “queue_size_limit” (int, default: 0)
- “antialias_start” (bool, default: false)
If enabled, the planner searches path from multiple surrounding grids within the grid size to reduce path chattering.
planner_2dof_serial_joints
planner_2dof_serial_joints provides collision avoidance for 2-DOF serial joint (e.g. controlling interfering pairs of sub-tracks for tracked vehicle.)
Subscribed topics
- ~/trajectory_in (new: trajectory_in) [trajectory_msgs::JointTrajectory]
- ~/joint (new: joint_states) [sensor_msgs::JointState]
- /tf
Published topics
- ~/trajectory_out (new: joint_trajectory) [trajectory_msgs::JointTrajectory]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
Called services
Parameters
- “resolution” (int, default: 128)
- “debug_aa” (bool, default: false)
- “replan_interval” (double, default: 0.2)
- “queue_size_limit” (int, default: 0)
- “link0_name” (string, default: std::string(“link0”))
- “link1_name” (string, default: std::string(“link1”))
- “point_vel_mode” (string, default: std::string(“prev”))
- “range” (int, default: 8)
- “num_groups” (int, default: 1)
File truncated at 100 lines see the full file
Changelog for package planner_cspace
0.18.1 (2025-06-06)
- planner_cspace: fix crowd escape to use original goal if reachable (#779)
- planner_cspace: fix error status during crowd escape (#776)
- Contributors: Atsushi Watanabe
0.18.0 (2025-05-13)
- Ignore temporary escape trigger if map is not received (#770)
- planner_cspace: crowd escape mode (#763)
- planner_cspace: fix flaky navigation tests (#768)
- Contributors: Atsushi Watanabe
0.17.7 (2025-04-16)
0.17.6 (2025-03-18)
- planner_cspace: fix flaky dynamic reconfigure test (#756)
- Contributors: Atsushi Watanabe
0.17.5 (2025-02-21)
- planner_cspace: reconstuct GridAstarModel3D only when necessary (#751)
- Contributors: Naotaka Hatao
0.17.4 (2025-01-20)
0.17.3 (2024-12-25)
- planner_cspace: add costmap_cspace integration test for out-of-bound position (#746)
- costmap_cspace: publish empty costmap_update on out-of-bound (#743)
- planner_cspace: reduce remember_updates calculation cost (#742)
- Contributors: Atsushi Watanabe
0.17.2 (2024-11-07)
- planner_3d: apply turn_penalty_cost_threshold in curve path (#739)
- Contributors: Naotaka Hatao
0.17.1 (2024-03-22)
- planner_3d: remove duplicated interpolation method (#733)
- Contributors: Naotaka Hatao
0.17.0 (2023-11-02)
- planner_3d: add an option to trigger planning by costmap updates (#727)
- planner_3d: fix cost calculation bug on in-place turning (#725)
- Contributors: Naotaka Hatao
0.16.0 (2023-09-14)
- planner_cspace: start planning from expected robot pose (#717)
- planner_cspace: add new parameters for cost function (#720)
- planner_cspace: refactor start pose building algorithm and fix finishing condition when start is relocated (#718)
- Contributors: Naotaka Hatao
0.15.0 (2023-08-30)
- planner_cspace: enable dynamic reconfigure (#714)
- planner_space: fix segmentation fault on out-of-map (#712)
- Contributors: Atsushi Watanabe, Naotaka Hatao
0.14.2 (2023-07-31)
- planner_cspace: improve peformance of DistanceMap (#709)
- planner_cspace: avoid multiple goal pose relocation (#708)
- Contributors: Naotaka Hatao
0.14.1 (2023-07-07)
- planner_cspace: fix error status handling after cost_estim_cache_ was not created (#705)
- Contributors: Naotaka Hatao
File truncated at 100 lines see the full file
Wiki Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
neonavigation | |
neonavigation_launch |
Launch files
Messages
Services
Plugins
Recent questions tagged planner_cspace at Robotics Stack Exchange
![]() |
planner_cspace package from neonavigation repocostmap_cspace joystick_interrupt map_organizer neonavigation neonavigation_common neonavigation_launch obj_to_pointcloud planner_cspace safety_limiter track_odometry trajectory_tracker |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.18.1 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/at-wat/neonavigation.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2025-06-20 |
Dev Status | DEVELOPED |
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
Additional Links
Maintainers
- Atsushi Watanabe
Authors
- Atsushi Watanabe
planner_cspace package
The topic names will be migrated to ROS recommended namespace model.
Set /neonavigation_compatible
parameter to 1
to use new topic names.
planner_3d
planner_3d node provides 2-D/3-DOF seamless global-local path and motion planner.
Subscribed topics
- ~/costmap (new: costmap) [costmap_cspace_msgs::CSpace3D]
- ~/costmap_update (new: costmap_update) [costmap_cspace_msgs::CSpace3DUpdate]
- ~/goal (new: move_base_simple/goal) [geometry_msgs::PoseStamped]
- /tf
Published topics
- ~/path (new: path) [nav_msgs::Path]
- ~/debug [sensor_msgs::PointCloud]
debug output of planner internal costmap
- ~/remembered [sensor_msgs::PointCloud]
debug output of obstacles probability estimated by BBF
- ~/path_start [geometry_msgs::PoseStamped]
- ~/path_end [geometry_msgs::PoseStamped]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
- ~/forget (new: forget_planning_cost) [std_srvs::Empty]
Called services
Parameters
- “goal_tolerance_lin” (double, default: 0.05)
- “goal_tolerance_ang” (double, default: 0.1)
- “goal_tolerance_ang_finish” (double, default: 0.05)
- “unknown_cost” (int, default: 100)
- “hist_cnt_max” (int, default: 20)
- “hist_cnt_thres” (int, default: 19)
- “hist_cost” (int, default: 90)
- “hist_ignore_range” (double, default: 1.0)
- “remember_updates” (bool, default: false)
- “local_range” (double, default: 2.5)
- “longcut_range” (double, default: 0.0)
- “esc_range” (double, default: 0.25)
- “find_best” (bool, default: true)
- “pos_jump” (double, default: 1.0)
- “yaw_jump” (double, default: 1.5)
- “jump_detect_frame” (string, default: base_link)
- “force_goal_orientation” (bool, default: true)
- “temporary_escape” (bool, default: true)
- “fast_map_update” (bool, default: false)
- “debug_mode” (string, default: std::string(“cost_estim”))
debug output data type
- “hyst”: path hysteresis cost
- “cost_estim”: estimated cost to the goal used as A* heuristic function
- “queue_size_limit” (int, default: 0)
- “antialias_start” (bool, default: false)
If enabled, the planner searches path from multiple surrounding grids within the grid size to reduce path chattering.
planner_2dof_serial_joints
planner_2dof_serial_joints provides collision avoidance for 2-DOF serial joint (e.g. controlling interfering pairs of sub-tracks for tracked vehicle.)
Subscribed topics
- ~/trajectory_in (new: trajectory_in) [trajectory_msgs::JointTrajectory]
- ~/joint (new: joint_states) [sensor_msgs::JointState]
- /tf
Published topics
- ~/trajectory_out (new: joint_trajectory) [trajectory_msgs::JointTrajectory]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
Called services
Parameters
- “resolution” (int, default: 128)
- “debug_aa” (bool, default: false)
- “replan_interval” (double, default: 0.2)
- “queue_size_limit” (int, default: 0)
- “link0_name” (string, default: std::string(“link0”))
- “link1_name” (string, default: std::string(“link1”))
- “point_vel_mode” (string, default: std::string(“prev”))
- “range” (int, default: 8)
- “num_groups” (int, default: 1)
File truncated at 100 lines see the full file
Changelog for package planner_cspace
0.18.1 (2025-06-06)
- planner_cspace: fix crowd escape to use original goal if reachable (#779)
- planner_cspace: fix error status during crowd escape (#776)
- Contributors: Atsushi Watanabe
0.18.0 (2025-05-13)
- Ignore temporary escape trigger if map is not received (#770)
- planner_cspace: crowd escape mode (#763)
- planner_cspace: fix flaky navigation tests (#768)
- Contributors: Atsushi Watanabe
0.17.7 (2025-04-16)
0.17.6 (2025-03-18)
- planner_cspace: fix flaky dynamic reconfigure test (#756)
- Contributors: Atsushi Watanabe
0.17.5 (2025-02-21)
- planner_cspace: reconstuct GridAstarModel3D only when necessary (#751)
- Contributors: Naotaka Hatao
0.17.4 (2025-01-20)
0.17.3 (2024-12-25)
- planner_cspace: add costmap_cspace integration test for out-of-bound position (#746)
- costmap_cspace: publish empty costmap_update on out-of-bound (#743)
- planner_cspace: reduce remember_updates calculation cost (#742)
- Contributors: Atsushi Watanabe
0.17.2 (2024-11-07)
- planner_3d: apply turn_penalty_cost_threshold in curve path (#739)
- Contributors: Naotaka Hatao
0.17.1 (2024-03-22)
- planner_3d: remove duplicated interpolation method (#733)
- Contributors: Naotaka Hatao
0.17.0 (2023-11-02)
- planner_3d: add an option to trigger planning by costmap updates (#727)
- planner_3d: fix cost calculation bug on in-place turning (#725)
- Contributors: Naotaka Hatao
0.16.0 (2023-09-14)
- planner_cspace: start planning from expected robot pose (#717)
- planner_cspace: add new parameters for cost function (#720)
- planner_cspace: refactor start pose building algorithm and fix finishing condition when start is relocated (#718)
- Contributors: Naotaka Hatao
0.15.0 (2023-08-30)
- planner_cspace: enable dynamic reconfigure (#714)
- planner_space: fix segmentation fault on out-of-map (#712)
- Contributors: Atsushi Watanabe, Naotaka Hatao
0.14.2 (2023-07-31)
- planner_cspace: improve peformance of DistanceMap (#709)
- planner_cspace: avoid multiple goal pose relocation (#708)
- Contributors: Naotaka Hatao
0.14.1 (2023-07-07)
- planner_cspace: fix error status handling after cost_estim_cache_ was not created (#705)
- Contributors: Naotaka Hatao
File truncated at 100 lines see the full file
Wiki Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
neonavigation | |
neonavigation_launch |
Launch files
Messages
Services
Plugins
Recent questions tagged planner_cspace at Robotics Stack Exchange
![]() |
planner_cspace package from neonavigation repocostmap_cspace joystick_interrupt map_organizer neonavigation neonavigation_common neonavigation_launch obj_to_pointcloud planner_cspace safety_limiter track_odometry trajectory_tracker |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.18.1 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/at-wat/neonavigation.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2025-06-20 |
Dev Status | DEVELOPED |
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
Additional Links
Maintainers
- Atsushi Watanabe
Authors
- Atsushi Watanabe
planner_cspace package
The topic names will be migrated to ROS recommended namespace model.
Set /neonavigation_compatible
parameter to 1
to use new topic names.
planner_3d
planner_3d node provides 2-D/3-DOF seamless global-local path and motion planner.
Subscribed topics
- ~/costmap (new: costmap) [costmap_cspace_msgs::CSpace3D]
- ~/costmap_update (new: costmap_update) [costmap_cspace_msgs::CSpace3DUpdate]
- ~/goal (new: move_base_simple/goal) [geometry_msgs::PoseStamped]
- /tf
Published topics
- ~/path (new: path) [nav_msgs::Path]
- ~/debug [sensor_msgs::PointCloud]
debug output of planner internal costmap
- ~/remembered [sensor_msgs::PointCloud]
debug output of obstacles probability estimated by BBF
- ~/path_start [geometry_msgs::PoseStamped]
- ~/path_end [geometry_msgs::PoseStamped]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
- ~/forget (new: forget_planning_cost) [std_srvs::Empty]
Called services
Parameters
- “goal_tolerance_lin” (double, default: 0.05)
- “goal_tolerance_ang” (double, default: 0.1)
- “goal_tolerance_ang_finish” (double, default: 0.05)
- “unknown_cost” (int, default: 100)
- “hist_cnt_max” (int, default: 20)
- “hist_cnt_thres” (int, default: 19)
- “hist_cost” (int, default: 90)
- “hist_ignore_range” (double, default: 1.0)
- “remember_updates” (bool, default: false)
- “local_range” (double, default: 2.5)
- “longcut_range” (double, default: 0.0)
- “esc_range” (double, default: 0.25)
- “find_best” (bool, default: true)
- “pos_jump” (double, default: 1.0)
- “yaw_jump” (double, default: 1.5)
- “jump_detect_frame” (string, default: base_link)
- “force_goal_orientation” (bool, default: true)
- “temporary_escape” (bool, default: true)
- “fast_map_update” (bool, default: false)
- “debug_mode” (string, default: std::string(“cost_estim”))
debug output data type
- “hyst”: path hysteresis cost
- “cost_estim”: estimated cost to the goal used as A* heuristic function
- “queue_size_limit” (int, default: 0)
- “antialias_start” (bool, default: false)
If enabled, the planner searches path from multiple surrounding grids within the grid size to reduce path chattering.
planner_2dof_serial_joints
planner_2dof_serial_joints provides collision avoidance for 2-DOF serial joint (e.g. controlling interfering pairs of sub-tracks for tracked vehicle.)
Subscribed topics
- ~/trajectory_in (new: trajectory_in) [trajectory_msgs::JointTrajectory]
- ~/joint (new: joint_states) [sensor_msgs::JointState]
- /tf
Published topics
- ~/trajectory_out (new: joint_trajectory) [trajectory_msgs::JointTrajectory]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
Called services
Parameters
- “resolution” (int, default: 128)
- “debug_aa” (bool, default: false)
- “replan_interval” (double, default: 0.2)
- “queue_size_limit” (int, default: 0)
- “link0_name” (string, default: std::string(“link0”))
- “link1_name” (string, default: std::string(“link1”))
- “point_vel_mode” (string, default: std::string(“prev”))
- “range” (int, default: 8)
- “num_groups” (int, default: 1)
File truncated at 100 lines see the full file
Changelog for package planner_cspace
0.18.1 (2025-06-06)
- planner_cspace: fix crowd escape to use original goal if reachable (#779)
- planner_cspace: fix error status during crowd escape (#776)
- Contributors: Atsushi Watanabe
0.18.0 (2025-05-13)
- Ignore temporary escape trigger if map is not received (#770)
- planner_cspace: crowd escape mode (#763)
- planner_cspace: fix flaky navigation tests (#768)
- Contributors: Atsushi Watanabe
0.17.7 (2025-04-16)
0.17.6 (2025-03-18)
- planner_cspace: fix flaky dynamic reconfigure test (#756)
- Contributors: Atsushi Watanabe
0.17.5 (2025-02-21)
- planner_cspace: reconstuct GridAstarModel3D only when necessary (#751)
- Contributors: Naotaka Hatao
0.17.4 (2025-01-20)
0.17.3 (2024-12-25)
- planner_cspace: add costmap_cspace integration test for out-of-bound position (#746)
- costmap_cspace: publish empty costmap_update on out-of-bound (#743)
- planner_cspace: reduce remember_updates calculation cost (#742)
- Contributors: Atsushi Watanabe
0.17.2 (2024-11-07)
- planner_3d: apply turn_penalty_cost_threshold in curve path (#739)
- Contributors: Naotaka Hatao
0.17.1 (2024-03-22)
- planner_3d: remove duplicated interpolation method (#733)
- Contributors: Naotaka Hatao
0.17.0 (2023-11-02)
- planner_3d: add an option to trigger planning by costmap updates (#727)
- planner_3d: fix cost calculation bug on in-place turning (#725)
- Contributors: Naotaka Hatao
0.16.0 (2023-09-14)
- planner_cspace: start planning from expected robot pose (#717)
- planner_cspace: add new parameters for cost function (#720)
- planner_cspace: refactor start pose building algorithm and fix finishing condition when start is relocated (#718)
- Contributors: Naotaka Hatao
0.15.0 (2023-08-30)
- planner_cspace: enable dynamic reconfigure (#714)
- planner_space: fix segmentation fault on out-of-map (#712)
- Contributors: Atsushi Watanabe, Naotaka Hatao
0.14.2 (2023-07-31)
- planner_cspace: improve peformance of DistanceMap (#709)
- planner_cspace: avoid multiple goal pose relocation (#708)
- Contributors: Naotaka Hatao
0.14.1 (2023-07-07)
- planner_cspace: fix error status handling after cost_estim_cache_ was not created (#705)
- Contributors: Naotaka Hatao
File truncated at 100 lines see the full file
Wiki Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
neonavigation | |
neonavigation_launch |
Launch files
Messages
Services
Plugins
Recent questions tagged planner_cspace at Robotics Stack Exchange
![]() |
planner_cspace package from neonavigation repocostmap_cspace joystick_interrupt map_organizer neonavigation neonavigation_common neonavigation_launch obj_to_pointcloud planner_cspace safety_limiter track_odometry trajectory_tracker |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.18.1 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/at-wat/neonavigation.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2025-06-20 |
Dev Status | DEVELOPED |
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
Additional Links
Maintainers
- Atsushi Watanabe
Authors
- Atsushi Watanabe
planner_cspace package
The topic names will be migrated to ROS recommended namespace model.
Set /neonavigation_compatible
parameter to 1
to use new topic names.
planner_3d
planner_3d node provides 2-D/3-DOF seamless global-local path and motion planner.
Subscribed topics
- ~/costmap (new: costmap) [costmap_cspace_msgs::CSpace3D]
- ~/costmap_update (new: costmap_update) [costmap_cspace_msgs::CSpace3DUpdate]
- ~/goal (new: move_base_simple/goal) [geometry_msgs::PoseStamped]
- /tf
Published topics
- ~/path (new: path) [nav_msgs::Path]
- ~/debug [sensor_msgs::PointCloud]
debug output of planner internal costmap
- ~/remembered [sensor_msgs::PointCloud]
debug output of obstacles probability estimated by BBF
- ~/path_start [geometry_msgs::PoseStamped]
- ~/path_end [geometry_msgs::PoseStamped]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
- ~/forget (new: forget_planning_cost) [std_srvs::Empty]
Called services
Parameters
- “goal_tolerance_lin” (double, default: 0.05)
- “goal_tolerance_ang” (double, default: 0.1)
- “goal_tolerance_ang_finish” (double, default: 0.05)
- “unknown_cost” (int, default: 100)
- “hist_cnt_max” (int, default: 20)
- “hist_cnt_thres” (int, default: 19)
- “hist_cost” (int, default: 90)
- “hist_ignore_range” (double, default: 1.0)
- “remember_updates” (bool, default: false)
- “local_range” (double, default: 2.5)
- “longcut_range” (double, default: 0.0)
- “esc_range” (double, default: 0.25)
- “find_best” (bool, default: true)
- “pos_jump” (double, default: 1.0)
- “yaw_jump” (double, default: 1.5)
- “jump_detect_frame” (string, default: base_link)
- “force_goal_orientation” (bool, default: true)
- “temporary_escape” (bool, default: true)
- “fast_map_update” (bool, default: false)
- “debug_mode” (string, default: std::string(“cost_estim”))
debug output data type
- “hyst”: path hysteresis cost
- “cost_estim”: estimated cost to the goal used as A* heuristic function
- “queue_size_limit” (int, default: 0)
- “antialias_start” (bool, default: false)
If enabled, the planner searches path from multiple surrounding grids within the grid size to reduce path chattering.
planner_2dof_serial_joints
planner_2dof_serial_joints provides collision avoidance for 2-DOF serial joint (e.g. controlling interfering pairs of sub-tracks for tracked vehicle.)
Subscribed topics
- ~/trajectory_in (new: trajectory_in) [trajectory_msgs::JointTrajectory]
- ~/joint (new: joint_states) [sensor_msgs::JointState]
- /tf
Published topics
- ~/trajectory_out (new: joint_trajectory) [trajectory_msgs::JointTrajectory]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
Called services
Parameters
- “resolution” (int, default: 128)
- “debug_aa” (bool, default: false)
- “replan_interval” (double, default: 0.2)
- “queue_size_limit” (int, default: 0)
- “link0_name” (string, default: std::string(“link0”))
- “link1_name” (string, default: std::string(“link1”))
- “point_vel_mode” (string, default: std::string(“prev”))
- “range” (int, default: 8)
- “num_groups” (int, default: 1)
File truncated at 100 lines see the full file
Changelog for package planner_cspace
0.18.1 (2025-06-06)
- planner_cspace: fix crowd escape to use original goal if reachable (#779)
- planner_cspace: fix error status during crowd escape (#776)
- Contributors: Atsushi Watanabe
0.18.0 (2025-05-13)
- Ignore temporary escape trigger if map is not received (#770)
- planner_cspace: crowd escape mode (#763)
- planner_cspace: fix flaky navigation tests (#768)
- Contributors: Atsushi Watanabe
0.17.7 (2025-04-16)
0.17.6 (2025-03-18)
- planner_cspace: fix flaky dynamic reconfigure test (#756)
- Contributors: Atsushi Watanabe
0.17.5 (2025-02-21)
- planner_cspace: reconstuct GridAstarModel3D only when necessary (#751)
- Contributors: Naotaka Hatao
0.17.4 (2025-01-20)
0.17.3 (2024-12-25)
- planner_cspace: add costmap_cspace integration test for out-of-bound position (#746)
- costmap_cspace: publish empty costmap_update on out-of-bound (#743)
- planner_cspace: reduce remember_updates calculation cost (#742)
- Contributors: Atsushi Watanabe
0.17.2 (2024-11-07)
- planner_3d: apply turn_penalty_cost_threshold in curve path (#739)
- Contributors: Naotaka Hatao
0.17.1 (2024-03-22)
- planner_3d: remove duplicated interpolation method (#733)
- Contributors: Naotaka Hatao
0.17.0 (2023-11-02)
- planner_3d: add an option to trigger planning by costmap updates (#727)
- planner_3d: fix cost calculation bug on in-place turning (#725)
- Contributors: Naotaka Hatao
0.16.0 (2023-09-14)
- planner_cspace: start planning from expected robot pose (#717)
- planner_cspace: add new parameters for cost function (#720)
- planner_cspace: refactor start pose building algorithm and fix finishing condition when start is relocated (#718)
- Contributors: Naotaka Hatao
0.15.0 (2023-08-30)
- planner_cspace: enable dynamic reconfigure (#714)
- planner_space: fix segmentation fault on out-of-map (#712)
- Contributors: Atsushi Watanabe, Naotaka Hatao
0.14.2 (2023-07-31)
- planner_cspace: improve peformance of DistanceMap (#709)
- planner_cspace: avoid multiple goal pose relocation (#708)
- Contributors: Naotaka Hatao
0.14.1 (2023-07-07)
- planner_cspace: fix error status handling after cost_estim_cache_ was not created (#705)
- Contributors: Naotaka Hatao
File truncated at 100 lines see the full file
Wiki Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
neonavigation | |
neonavigation_launch |
Launch files
Messages
Services
Plugins
Recent questions tagged planner_cspace at Robotics Stack Exchange
![]() |
planner_cspace package from neonavigation repocostmap_cspace joystick_interrupt map_organizer neonavigation neonavigation_common neonavigation_launch obj_to_pointcloud planner_cspace safety_limiter track_odometry trajectory_tracker |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.18.1 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/at-wat/neonavigation.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2025-06-20 |
Dev Status | DEVELOPED |
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
Additional Links
Maintainers
- Atsushi Watanabe
Authors
- Atsushi Watanabe
planner_cspace package
The topic names will be migrated to ROS recommended namespace model.
Set /neonavigation_compatible
parameter to 1
to use new topic names.
planner_3d
planner_3d node provides 2-D/3-DOF seamless global-local path and motion planner.
Subscribed topics
- ~/costmap (new: costmap) [costmap_cspace_msgs::CSpace3D]
- ~/costmap_update (new: costmap_update) [costmap_cspace_msgs::CSpace3DUpdate]
- ~/goal (new: move_base_simple/goal) [geometry_msgs::PoseStamped]
- /tf
Published topics
- ~/path (new: path) [nav_msgs::Path]
- ~/debug [sensor_msgs::PointCloud]
debug output of planner internal costmap
- ~/remembered [sensor_msgs::PointCloud]
debug output of obstacles probability estimated by BBF
- ~/path_start [geometry_msgs::PoseStamped]
- ~/path_end [geometry_msgs::PoseStamped]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
- ~/forget (new: forget_planning_cost) [std_srvs::Empty]
Called services
Parameters
- “goal_tolerance_lin” (double, default: 0.05)
- “goal_tolerance_ang” (double, default: 0.1)
- “goal_tolerance_ang_finish” (double, default: 0.05)
- “unknown_cost” (int, default: 100)
- “hist_cnt_max” (int, default: 20)
- “hist_cnt_thres” (int, default: 19)
- “hist_cost” (int, default: 90)
- “hist_ignore_range” (double, default: 1.0)
- “remember_updates” (bool, default: false)
- “local_range” (double, default: 2.5)
- “longcut_range” (double, default: 0.0)
- “esc_range” (double, default: 0.25)
- “find_best” (bool, default: true)
- “pos_jump” (double, default: 1.0)
- “yaw_jump” (double, default: 1.5)
- “jump_detect_frame” (string, default: base_link)
- “force_goal_orientation” (bool, default: true)
- “temporary_escape” (bool, default: true)
- “fast_map_update” (bool, default: false)
- “debug_mode” (string, default: std::string(“cost_estim”))
debug output data type
- “hyst”: path hysteresis cost
- “cost_estim”: estimated cost to the goal used as A* heuristic function
- “queue_size_limit” (int, default: 0)
- “antialias_start” (bool, default: false)
If enabled, the planner searches path from multiple surrounding grids within the grid size to reduce path chattering.
planner_2dof_serial_joints
planner_2dof_serial_joints provides collision avoidance for 2-DOF serial joint (e.g. controlling interfering pairs of sub-tracks for tracked vehicle.)
Subscribed topics
- ~/trajectory_in (new: trajectory_in) [trajectory_msgs::JointTrajectory]
- ~/joint (new: joint_states) [sensor_msgs::JointState]
- /tf
Published topics
- ~/trajectory_out (new: joint_trajectory) [trajectory_msgs::JointTrajectory]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
Called services
Parameters
- “resolution” (int, default: 128)
- “debug_aa” (bool, default: false)
- “replan_interval” (double, default: 0.2)
- “queue_size_limit” (int, default: 0)
- “link0_name” (string, default: std::string(“link0”))
- “link1_name” (string, default: std::string(“link1”))
- “point_vel_mode” (string, default: std::string(“prev”))
- “range” (int, default: 8)
- “num_groups” (int, default: 1)
File truncated at 100 lines see the full file
Changelog for package planner_cspace
0.18.1 (2025-06-06)
- planner_cspace: fix crowd escape to use original goal if reachable (#779)
- planner_cspace: fix error status during crowd escape (#776)
- Contributors: Atsushi Watanabe
0.18.0 (2025-05-13)
- Ignore temporary escape trigger if map is not received (#770)
- planner_cspace: crowd escape mode (#763)
- planner_cspace: fix flaky navigation tests (#768)
- Contributors: Atsushi Watanabe
0.17.7 (2025-04-16)
0.17.6 (2025-03-18)
- planner_cspace: fix flaky dynamic reconfigure test (#756)
- Contributors: Atsushi Watanabe
0.17.5 (2025-02-21)
- planner_cspace: reconstuct GridAstarModel3D only when necessary (#751)
- Contributors: Naotaka Hatao
0.17.4 (2025-01-20)
0.17.3 (2024-12-25)
- planner_cspace: add costmap_cspace integration test for out-of-bound position (#746)
- costmap_cspace: publish empty costmap_update on out-of-bound (#743)
- planner_cspace: reduce remember_updates calculation cost (#742)
- Contributors: Atsushi Watanabe
0.17.2 (2024-11-07)
- planner_3d: apply turn_penalty_cost_threshold in curve path (#739)
- Contributors: Naotaka Hatao
0.17.1 (2024-03-22)
- planner_3d: remove duplicated interpolation method (#733)
- Contributors: Naotaka Hatao
0.17.0 (2023-11-02)
- planner_3d: add an option to trigger planning by costmap updates (#727)
- planner_3d: fix cost calculation bug on in-place turning (#725)
- Contributors: Naotaka Hatao
0.16.0 (2023-09-14)
- planner_cspace: start planning from expected robot pose (#717)
- planner_cspace: add new parameters for cost function (#720)
- planner_cspace: refactor start pose building algorithm and fix finishing condition when start is relocated (#718)
- Contributors: Naotaka Hatao
0.15.0 (2023-08-30)
- planner_cspace: enable dynamic reconfigure (#714)
- planner_space: fix segmentation fault on out-of-map (#712)
- Contributors: Atsushi Watanabe, Naotaka Hatao
0.14.2 (2023-07-31)
- planner_cspace: improve peformance of DistanceMap (#709)
- planner_cspace: avoid multiple goal pose relocation (#708)
- Contributors: Naotaka Hatao
0.14.1 (2023-07-07)
- planner_cspace: fix error status handling after cost_estim_cache_ was not created (#705)
- Contributors: Naotaka Hatao
File truncated at 100 lines see the full file
Wiki Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
neonavigation | |
neonavigation_launch |
Launch files
Messages
Services
Plugins
Recent questions tagged planner_cspace at Robotics Stack Exchange
![]() |
planner_cspace package from neonavigation repocostmap_cspace joystick_interrupt map_organizer neonavigation neonavigation_common neonavigation_launch obj_to_pointcloud planner_cspace safety_limiter track_odometry trajectory_tracker |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.18.1 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/at-wat/neonavigation.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2025-06-20 |
Dev Status | DEVELOPED |
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
Additional Links
Maintainers
- Atsushi Watanabe
Authors
- Atsushi Watanabe
planner_cspace package
The topic names will be migrated to ROS recommended namespace model.
Set /neonavigation_compatible
parameter to 1
to use new topic names.
planner_3d
planner_3d node provides 2-D/3-DOF seamless global-local path and motion planner.
Subscribed topics
- ~/costmap (new: costmap) [costmap_cspace_msgs::CSpace3D]
- ~/costmap_update (new: costmap_update) [costmap_cspace_msgs::CSpace3DUpdate]
- ~/goal (new: move_base_simple/goal) [geometry_msgs::PoseStamped]
- /tf
Published topics
- ~/path (new: path) [nav_msgs::Path]
- ~/debug [sensor_msgs::PointCloud]
debug output of planner internal costmap
- ~/remembered [sensor_msgs::PointCloud]
debug output of obstacles probability estimated by BBF
- ~/path_start [geometry_msgs::PoseStamped]
- ~/path_end [geometry_msgs::PoseStamped]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
- ~/forget (new: forget_planning_cost) [std_srvs::Empty]
Called services
Parameters
- “goal_tolerance_lin” (double, default: 0.05)
- “goal_tolerance_ang” (double, default: 0.1)
- “goal_tolerance_ang_finish” (double, default: 0.05)
- “unknown_cost” (int, default: 100)
- “hist_cnt_max” (int, default: 20)
- “hist_cnt_thres” (int, default: 19)
- “hist_cost” (int, default: 90)
- “hist_ignore_range” (double, default: 1.0)
- “remember_updates” (bool, default: false)
- “local_range” (double, default: 2.5)
- “longcut_range” (double, default: 0.0)
- “esc_range” (double, default: 0.25)
- “find_best” (bool, default: true)
- “pos_jump” (double, default: 1.0)
- “yaw_jump” (double, default: 1.5)
- “jump_detect_frame” (string, default: base_link)
- “force_goal_orientation” (bool, default: true)
- “temporary_escape” (bool, default: true)
- “fast_map_update” (bool, default: false)
- “debug_mode” (string, default: std::string(“cost_estim”))
debug output data type
- “hyst”: path hysteresis cost
- “cost_estim”: estimated cost to the goal used as A* heuristic function
- “queue_size_limit” (int, default: 0)
- “antialias_start” (bool, default: false)
If enabled, the planner searches path from multiple surrounding grids within the grid size to reduce path chattering.
planner_2dof_serial_joints
planner_2dof_serial_joints provides collision avoidance for 2-DOF serial joint (e.g. controlling interfering pairs of sub-tracks for tracked vehicle.)
Subscribed topics
- ~/trajectory_in (new: trajectory_in) [trajectory_msgs::JointTrajectory]
- ~/joint (new: joint_states) [sensor_msgs::JointState]
- /tf
Published topics
- ~/trajectory_out (new: joint_trajectory) [trajectory_msgs::JointTrajectory]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
Called services
Parameters
- “resolution” (int, default: 128)
- “debug_aa” (bool, default: false)
- “replan_interval” (double, default: 0.2)
- “queue_size_limit” (int, default: 0)
- “link0_name” (string, default: std::string(“link0”))
- “link1_name” (string, default: std::string(“link1”))
- “point_vel_mode” (string, default: std::string(“prev”))
- “range” (int, default: 8)
- “num_groups” (int, default: 1)
File truncated at 100 lines see the full file
Changelog for package planner_cspace
0.18.1 (2025-06-06)
- planner_cspace: fix crowd escape to use original goal if reachable (#779)
- planner_cspace: fix error status during crowd escape (#776)
- Contributors: Atsushi Watanabe
0.18.0 (2025-05-13)
- Ignore temporary escape trigger if map is not received (#770)
- planner_cspace: crowd escape mode (#763)
- planner_cspace: fix flaky navigation tests (#768)
- Contributors: Atsushi Watanabe
0.17.7 (2025-04-16)
0.17.6 (2025-03-18)
- planner_cspace: fix flaky dynamic reconfigure test (#756)
- Contributors: Atsushi Watanabe
0.17.5 (2025-02-21)
- planner_cspace: reconstuct GridAstarModel3D only when necessary (#751)
- Contributors: Naotaka Hatao
0.17.4 (2025-01-20)
0.17.3 (2024-12-25)
- planner_cspace: add costmap_cspace integration test for out-of-bound position (#746)
- costmap_cspace: publish empty costmap_update on out-of-bound (#743)
- planner_cspace: reduce remember_updates calculation cost (#742)
- Contributors: Atsushi Watanabe
0.17.2 (2024-11-07)
- planner_3d: apply turn_penalty_cost_threshold in curve path (#739)
- Contributors: Naotaka Hatao
0.17.1 (2024-03-22)
- planner_3d: remove duplicated interpolation method (#733)
- Contributors: Naotaka Hatao
0.17.0 (2023-11-02)
- planner_3d: add an option to trigger planning by costmap updates (#727)
- planner_3d: fix cost calculation bug on in-place turning (#725)
- Contributors: Naotaka Hatao
0.16.0 (2023-09-14)
- planner_cspace: start planning from expected robot pose (#717)
- planner_cspace: add new parameters for cost function (#720)
- planner_cspace: refactor start pose building algorithm and fix finishing condition when start is relocated (#718)
- Contributors: Naotaka Hatao
0.15.0 (2023-08-30)
- planner_cspace: enable dynamic reconfigure (#714)
- planner_space: fix segmentation fault on out-of-map (#712)
- Contributors: Atsushi Watanabe, Naotaka Hatao
0.14.2 (2023-07-31)
- planner_cspace: improve peformance of DistanceMap (#709)
- planner_cspace: avoid multiple goal pose relocation (#708)
- Contributors: Naotaka Hatao
0.14.1 (2023-07-07)
- planner_cspace: fix error status handling after cost_estim_cache_ was not created (#705)
- Contributors: Naotaka Hatao
File truncated at 100 lines see the full file
Wiki Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
neonavigation | |
neonavigation_launch |
Launch files
Messages
Services
Plugins
Recent questions tagged planner_cspace at Robotics Stack Exchange
![]() |
planner_cspace package from neonavigation repocostmap_cspace joystick_interrupt map_organizer neonavigation neonavigation_common neonavigation_launch obj_to_pointcloud planner_cspace safety_limiter track_odometry trajectory_tracker |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.18.1 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/at-wat/neonavigation.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2025-06-20 |
Dev Status | DEVELOPED |
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
Additional Links
Maintainers
- Atsushi Watanabe
Authors
- Atsushi Watanabe
planner_cspace package
The topic names will be migrated to ROS recommended namespace model.
Set /neonavigation_compatible
parameter to 1
to use new topic names.
planner_3d
planner_3d node provides 2-D/3-DOF seamless global-local path and motion planner.
Subscribed topics
- ~/costmap (new: costmap) [costmap_cspace_msgs::CSpace3D]
- ~/costmap_update (new: costmap_update) [costmap_cspace_msgs::CSpace3DUpdate]
- ~/goal (new: move_base_simple/goal) [geometry_msgs::PoseStamped]
- /tf
Published topics
- ~/path (new: path) [nav_msgs::Path]
- ~/debug [sensor_msgs::PointCloud]
debug output of planner internal costmap
- ~/remembered [sensor_msgs::PointCloud]
debug output of obstacles probability estimated by BBF
- ~/path_start [geometry_msgs::PoseStamped]
- ~/path_end [geometry_msgs::PoseStamped]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
- ~/forget (new: forget_planning_cost) [std_srvs::Empty]
Called services
Parameters
- “goal_tolerance_lin” (double, default: 0.05)
- “goal_tolerance_ang” (double, default: 0.1)
- “goal_tolerance_ang_finish” (double, default: 0.05)
- “unknown_cost” (int, default: 100)
- “hist_cnt_max” (int, default: 20)
- “hist_cnt_thres” (int, default: 19)
- “hist_cost” (int, default: 90)
- “hist_ignore_range” (double, default: 1.0)
- “remember_updates” (bool, default: false)
- “local_range” (double, default: 2.5)
- “longcut_range” (double, default: 0.0)
- “esc_range” (double, default: 0.25)
- “find_best” (bool, default: true)
- “pos_jump” (double, default: 1.0)
- “yaw_jump” (double, default: 1.5)
- “jump_detect_frame” (string, default: base_link)
- “force_goal_orientation” (bool, default: true)
- “temporary_escape” (bool, default: true)
- “fast_map_update” (bool, default: false)
- “debug_mode” (string, default: std::string(“cost_estim”))
debug output data type
- “hyst”: path hysteresis cost
- “cost_estim”: estimated cost to the goal used as A* heuristic function
- “queue_size_limit” (int, default: 0)
- “antialias_start” (bool, default: false)
If enabled, the planner searches path from multiple surrounding grids within the grid size to reduce path chattering.
planner_2dof_serial_joints
planner_2dof_serial_joints provides collision avoidance for 2-DOF serial joint (e.g. controlling interfering pairs of sub-tracks for tracked vehicle.)
Subscribed topics
- ~/trajectory_in (new: trajectory_in) [trajectory_msgs::JointTrajectory]
- ~/joint (new: joint_states) [sensor_msgs::JointState]
- /tf
Published topics
- ~/trajectory_out (new: joint_trajectory) [trajectory_msgs::JointTrajectory]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
Called services
Parameters
- “resolution” (int, default: 128)
- “debug_aa” (bool, default: false)
- “replan_interval” (double, default: 0.2)
- “queue_size_limit” (int, default: 0)
- “link0_name” (string, default: std::string(“link0”))
- “link1_name” (string, default: std::string(“link1”))
- “point_vel_mode” (string, default: std::string(“prev”))
- “range” (int, default: 8)
- “num_groups” (int, default: 1)
File truncated at 100 lines see the full file
Changelog for package planner_cspace
0.18.1 (2025-06-06)
- planner_cspace: fix crowd escape to use original goal if reachable (#779)
- planner_cspace: fix error status during crowd escape (#776)
- Contributors: Atsushi Watanabe
0.18.0 (2025-05-13)
- Ignore temporary escape trigger if map is not received (#770)
- planner_cspace: crowd escape mode (#763)
- planner_cspace: fix flaky navigation tests (#768)
- Contributors: Atsushi Watanabe
0.17.7 (2025-04-16)
0.17.6 (2025-03-18)
- planner_cspace: fix flaky dynamic reconfigure test (#756)
- Contributors: Atsushi Watanabe
0.17.5 (2025-02-21)
- planner_cspace: reconstuct GridAstarModel3D only when necessary (#751)
- Contributors: Naotaka Hatao
0.17.4 (2025-01-20)
0.17.3 (2024-12-25)
- planner_cspace: add costmap_cspace integration test for out-of-bound position (#746)
- costmap_cspace: publish empty costmap_update on out-of-bound (#743)
- planner_cspace: reduce remember_updates calculation cost (#742)
- Contributors: Atsushi Watanabe
0.17.2 (2024-11-07)
- planner_3d: apply turn_penalty_cost_threshold in curve path (#739)
- Contributors: Naotaka Hatao
0.17.1 (2024-03-22)
- planner_3d: remove duplicated interpolation method (#733)
- Contributors: Naotaka Hatao
0.17.0 (2023-11-02)
- planner_3d: add an option to trigger planning by costmap updates (#727)
- planner_3d: fix cost calculation bug on in-place turning (#725)
- Contributors: Naotaka Hatao
0.16.0 (2023-09-14)
- planner_cspace: start planning from expected robot pose (#717)
- planner_cspace: add new parameters for cost function (#720)
- planner_cspace: refactor start pose building algorithm and fix finishing condition when start is relocated (#718)
- Contributors: Naotaka Hatao
0.15.0 (2023-08-30)
- planner_cspace: enable dynamic reconfigure (#714)
- planner_space: fix segmentation fault on out-of-map (#712)
- Contributors: Atsushi Watanabe, Naotaka Hatao
0.14.2 (2023-07-31)
- planner_cspace: improve peformance of DistanceMap (#709)
- planner_cspace: avoid multiple goal pose relocation (#708)
- Contributors: Naotaka Hatao
0.14.1 (2023-07-07)
- planner_cspace: fix error status handling after cost_estim_cache_ was not created (#705)
- Contributors: Naotaka Hatao
File truncated at 100 lines see the full file
Wiki Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
neonavigation | |
neonavigation_launch |
Launch files
Messages
Services
Plugins
Recent questions tagged planner_cspace at Robotics Stack Exchange
![]() |
planner_cspace package from neonavigation repocostmap_cspace joystick_interrupt map_organizer neonavigation neonavigation_common neonavigation_launch obj_to_pointcloud planner_cspace safety_limiter track_odometry trajectory_tracker |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.18.1 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/at-wat/neonavigation.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2025-06-20 |
Dev Status | DEVELOPED |
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
Additional Links
Maintainers
- Atsushi Watanabe
Authors
- Atsushi Watanabe
planner_cspace package
The topic names will be migrated to ROS recommended namespace model.
Set /neonavigation_compatible
parameter to 1
to use new topic names.
planner_3d
planner_3d node provides 2-D/3-DOF seamless global-local path and motion planner.
Subscribed topics
- ~/costmap (new: costmap) [costmap_cspace_msgs::CSpace3D]
- ~/costmap_update (new: costmap_update) [costmap_cspace_msgs::CSpace3DUpdate]
- ~/goal (new: move_base_simple/goal) [geometry_msgs::PoseStamped]
- /tf
Published topics
- ~/path (new: path) [nav_msgs::Path]
- ~/debug [sensor_msgs::PointCloud]
debug output of planner internal costmap
- ~/remembered [sensor_msgs::PointCloud]
debug output of obstacles probability estimated by BBF
- ~/path_start [geometry_msgs::PoseStamped]
- ~/path_end [geometry_msgs::PoseStamped]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
- ~/forget (new: forget_planning_cost) [std_srvs::Empty]
Called services
Parameters
- “goal_tolerance_lin” (double, default: 0.05)
- “goal_tolerance_ang” (double, default: 0.1)
- “goal_tolerance_ang_finish” (double, default: 0.05)
- “unknown_cost” (int, default: 100)
- “hist_cnt_max” (int, default: 20)
- “hist_cnt_thres” (int, default: 19)
- “hist_cost” (int, default: 90)
- “hist_ignore_range” (double, default: 1.0)
- “remember_updates” (bool, default: false)
- “local_range” (double, default: 2.5)
- “longcut_range” (double, default: 0.0)
- “esc_range” (double, default: 0.25)
- “find_best” (bool, default: true)
- “pos_jump” (double, default: 1.0)
- “yaw_jump” (double, default: 1.5)
- “jump_detect_frame” (string, default: base_link)
- “force_goal_orientation” (bool, default: true)
- “temporary_escape” (bool, default: true)
- “fast_map_update” (bool, default: false)
- “debug_mode” (string, default: std::string(“cost_estim”))
debug output data type
- “hyst”: path hysteresis cost
- “cost_estim”: estimated cost to the goal used as A* heuristic function
- “queue_size_limit” (int, default: 0)
- “antialias_start” (bool, default: false)
If enabled, the planner searches path from multiple surrounding grids within the grid size to reduce path chattering.
planner_2dof_serial_joints
planner_2dof_serial_joints provides collision avoidance for 2-DOF serial joint (e.g. controlling interfering pairs of sub-tracks for tracked vehicle.)
Subscribed topics
- ~/trajectory_in (new: trajectory_in) [trajectory_msgs::JointTrajectory]
- ~/joint (new: joint_states) [sensor_msgs::JointState]
- /tf
Published topics
- ~/trajectory_out (new: joint_trajectory) [trajectory_msgs::JointTrajectory]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
Called services
Parameters
- “resolution” (int, default: 128)
- “debug_aa” (bool, default: false)
- “replan_interval” (double, default: 0.2)
- “queue_size_limit” (int, default: 0)
- “link0_name” (string, default: std::string(“link0”))
- “link1_name” (string, default: std::string(“link1”))
- “point_vel_mode” (string, default: std::string(“prev”))
- “range” (int, default: 8)
- “num_groups” (int, default: 1)
File truncated at 100 lines see the full file
Changelog for package planner_cspace
0.18.1 (2025-06-06)
- planner_cspace: fix crowd escape to use original goal if reachable (#779)
- planner_cspace: fix error status during crowd escape (#776)
- Contributors: Atsushi Watanabe
0.18.0 (2025-05-13)
- Ignore temporary escape trigger if map is not received (#770)
- planner_cspace: crowd escape mode (#763)
- planner_cspace: fix flaky navigation tests (#768)
- Contributors: Atsushi Watanabe
0.17.7 (2025-04-16)
0.17.6 (2025-03-18)
- planner_cspace: fix flaky dynamic reconfigure test (#756)
- Contributors: Atsushi Watanabe
0.17.5 (2025-02-21)
- planner_cspace: reconstuct GridAstarModel3D only when necessary (#751)
- Contributors: Naotaka Hatao
0.17.4 (2025-01-20)
0.17.3 (2024-12-25)
- planner_cspace: add costmap_cspace integration test for out-of-bound position (#746)
- costmap_cspace: publish empty costmap_update on out-of-bound (#743)
- planner_cspace: reduce remember_updates calculation cost (#742)
- Contributors: Atsushi Watanabe
0.17.2 (2024-11-07)
- planner_3d: apply turn_penalty_cost_threshold in curve path (#739)
- Contributors: Naotaka Hatao
0.17.1 (2024-03-22)
- planner_3d: remove duplicated interpolation method (#733)
- Contributors: Naotaka Hatao
0.17.0 (2023-11-02)
- planner_3d: add an option to trigger planning by costmap updates (#727)
- planner_3d: fix cost calculation bug on in-place turning (#725)
- Contributors: Naotaka Hatao
0.16.0 (2023-09-14)
- planner_cspace: start planning from expected robot pose (#717)
- planner_cspace: add new parameters for cost function (#720)
- planner_cspace: refactor start pose building algorithm and fix finishing condition when start is relocated (#718)
- Contributors: Naotaka Hatao
0.15.0 (2023-08-30)
- planner_cspace: enable dynamic reconfigure (#714)
- planner_space: fix segmentation fault on out-of-map (#712)
- Contributors: Atsushi Watanabe, Naotaka Hatao
0.14.2 (2023-07-31)
- planner_cspace: improve peformance of DistanceMap (#709)
- planner_cspace: avoid multiple goal pose relocation (#708)
- Contributors: Naotaka Hatao
0.14.1 (2023-07-07)
- planner_cspace: fix error status handling after cost_estim_cache_ was not created (#705)
- Contributors: Naotaka Hatao
File truncated at 100 lines see the full file
Wiki Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
neonavigation | |
neonavigation_launch |
Launch files
Messages
Services
Plugins
Recent questions tagged planner_cspace at Robotics Stack Exchange
![]() |
planner_cspace package from neonavigation repocostmap_cspace joystick_interrupt map_organizer neonavigation neonavigation_common neonavigation_launch obj_to_pointcloud planner_cspace safety_limiter track_odometry trajectory_tracker |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.18.1 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/at-wat/neonavigation.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2025-06-20 |
Dev Status | DEVELOPED |
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
Additional Links
Maintainers
- Atsushi Watanabe
Authors
- Atsushi Watanabe
planner_cspace package
The topic names will be migrated to ROS recommended namespace model.
Set /neonavigation_compatible
parameter to 1
to use new topic names.
planner_3d
planner_3d node provides 2-D/3-DOF seamless global-local path and motion planner.
Subscribed topics
- ~/costmap (new: costmap) [costmap_cspace_msgs::CSpace3D]
- ~/costmap_update (new: costmap_update) [costmap_cspace_msgs::CSpace3DUpdate]
- ~/goal (new: move_base_simple/goal) [geometry_msgs::PoseStamped]
- /tf
Published topics
- ~/path (new: path) [nav_msgs::Path]
- ~/debug [sensor_msgs::PointCloud]
debug output of planner internal costmap
- ~/remembered [sensor_msgs::PointCloud]
debug output of obstacles probability estimated by BBF
- ~/path_start [geometry_msgs::PoseStamped]
- ~/path_end [geometry_msgs::PoseStamped]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
- ~/forget (new: forget_planning_cost) [std_srvs::Empty]
Called services
Parameters
- “goal_tolerance_lin” (double, default: 0.05)
- “goal_tolerance_ang” (double, default: 0.1)
- “goal_tolerance_ang_finish” (double, default: 0.05)
- “unknown_cost” (int, default: 100)
- “hist_cnt_max” (int, default: 20)
- “hist_cnt_thres” (int, default: 19)
- “hist_cost” (int, default: 90)
- “hist_ignore_range” (double, default: 1.0)
- “remember_updates” (bool, default: false)
- “local_range” (double, default: 2.5)
- “longcut_range” (double, default: 0.0)
- “esc_range” (double, default: 0.25)
- “find_best” (bool, default: true)
- “pos_jump” (double, default: 1.0)
- “yaw_jump” (double, default: 1.5)
- “jump_detect_frame” (string, default: base_link)
- “force_goal_orientation” (bool, default: true)
- “temporary_escape” (bool, default: true)
- “fast_map_update” (bool, default: false)
- “debug_mode” (string, default: std::string(“cost_estim”))
debug output data type
- “hyst”: path hysteresis cost
- “cost_estim”: estimated cost to the goal used as A* heuristic function
- “queue_size_limit” (int, default: 0)
- “antialias_start” (bool, default: false)
If enabled, the planner searches path from multiple surrounding grids within the grid size to reduce path chattering.
planner_2dof_serial_joints
planner_2dof_serial_joints provides collision avoidance for 2-DOF serial joint (e.g. controlling interfering pairs of sub-tracks for tracked vehicle.)
Subscribed topics
- ~/trajectory_in (new: trajectory_in) [trajectory_msgs::JointTrajectory]
- ~/joint (new: joint_states) [sensor_msgs::JointState]
- /tf
Published topics
- ~/trajectory_out (new: joint_trajectory) [trajectory_msgs::JointTrajectory]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
Called services
Parameters
- “resolution” (int, default: 128)
- “debug_aa” (bool, default: false)
- “replan_interval” (double, default: 0.2)
- “queue_size_limit” (int, default: 0)
- “link0_name” (string, default: std::string(“link0”))
- “link1_name” (string, default: std::string(“link1”))
- “point_vel_mode” (string, default: std::string(“prev”))
- “range” (int, default: 8)
- “num_groups” (int, default: 1)
File truncated at 100 lines see the full file
Changelog for package planner_cspace
0.18.1 (2025-06-06)
- planner_cspace: fix crowd escape to use original goal if reachable (#779)
- planner_cspace: fix error status during crowd escape (#776)
- Contributors: Atsushi Watanabe
0.18.0 (2025-05-13)
- Ignore temporary escape trigger if map is not received (#770)
- planner_cspace: crowd escape mode (#763)
- planner_cspace: fix flaky navigation tests (#768)
- Contributors: Atsushi Watanabe
0.17.7 (2025-04-16)
0.17.6 (2025-03-18)
- planner_cspace: fix flaky dynamic reconfigure test (#756)
- Contributors: Atsushi Watanabe
0.17.5 (2025-02-21)
- planner_cspace: reconstuct GridAstarModel3D only when necessary (#751)
- Contributors: Naotaka Hatao
0.17.4 (2025-01-20)
0.17.3 (2024-12-25)
- planner_cspace: add costmap_cspace integration test for out-of-bound position (#746)
- costmap_cspace: publish empty costmap_update on out-of-bound (#743)
- planner_cspace: reduce remember_updates calculation cost (#742)
- Contributors: Atsushi Watanabe
0.17.2 (2024-11-07)
- planner_3d: apply turn_penalty_cost_threshold in curve path (#739)
- Contributors: Naotaka Hatao
0.17.1 (2024-03-22)
- planner_3d: remove duplicated interpolation method (#733)
- Contributors: Naotaka Hatao
0.17.0 (2023-11-02)
- planner_3d: add an option to trigger planning by costmap updates (#727)
- planner_3d: fix cost calculation bug on in-place turning (#725)
- Contributors: Naotaka Hatao
0.16.0 (2023-09-14)
- planner_cspace: start planning from expected robot pose (#717)
- planner_cspace: add new parameters for cost function (#720)
- planner_cspace: refactor start pose building algorithm and fix finishing condition when start is relocated (#718)
- Contributors: Naotaka Hatao
0.15.0 (2023-08-30)
- planner_cspace: enable dynamic reconfigure (#714)
- planner_space: fix segmentation fault on out-of-map (#712)
- Contributors: Atsushi Watanabe, Naotaka Hatao
0.14.2 (2023-07-31)
- planner_cspace: improve peformance of DistanceMap (#709)
- planner_cspace: avoid multiple goal pose relocation (#708)
- Contributors: Naotaka Hatao
0.14.1 (2023-07-07)
- planner_cspace: fix error status handling after cost_estim_cache_ was not created (#705)
- Contributors: Naotaka Hatao
File truncated at 100 lines see the full file
Wiki Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
neonavigation | |
neonavigation_launch |
Launch files
Messages
Services
Plugins
Recent questions tagged planner_cspace at Robotics Stack Exchange
![]() |
planner_cspace package from neonavigation repocostmap_cspace joystick_interrupt map_organizer neonavigation neonavigation_common neonavigation_launch obj_to_pointcloud planner_cspace safety_limiter track_odometry trajectory_tracker |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.18.1 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/at-wat/neonavigation.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2025-06-20 |
Dev Status | DEVELOPED |
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
Additional Links
Maintainers
- Atsushi Watanabe
Authors
- Atsushi Watanabe
planner_cspace package
The topic names will be migrated to ROS recommended namespace model.
Set /neonavigation_compatible
parameter to 1
to use new topic names.
planner_3d
planner_3d node provides 2-D/3-DOF seamless global-local path and motion planner.
Subscribed topics
- ~/costmap (new: costmap) [costmap_cspace_msgs::CSpace3D]
- ~/costmap_update (new: costmap_update) [costmap_cspace_msgs::CSpace3DUpdate]
- ~/goal (new: move_base_simple/goal) [geometry_msgs::PoseStamped]
- /tf
Published topics
- ~/path (new: path) [nav_msgs::Path]
- ~/debug [sensor_msgs::PointCloud]
debug output of planner internal costmap
- ~/remembered [sensor_msgs::PointCloud]
debug output of obstacles probability estimated by BBF
- ~/path_start [geometry_msgs::PoseStamped]
- ~/path_end [geometry_msgs::PoseStamped]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
- ~/forget (new: forget_planning_cost) [std_srvs::Empty]
Called services
Parameters
- “goal_tolerance_lin” (double, default: 0.05)
- “goal_tolerance_ang” (double, default: 0.1)
- “goal_tolerance_ang_finish” (double, default: 0.05)
- “unknown_cost” (int, default: 100)
- “hist_cnt_max” (int, default: 20)
- “hist_cnt_thres” (int, default: 19)
- “hist_cost” (int, default: 90)
- “hist_ignore_range” (double, default: 1.0)
- “remember_updates” (bool, default: false)
- “local_range” (double, default: 2.5)
- “longcut_range” (double, default: 0.0)
- “esc_range” (double, default: 0.25)
- “find_best” (bool, default: true)
- “pos_jump” (double, default: 1.0)
- “yaw_jump” (double, default: 1.5)
- “jump_detect_frame” (string, default: base_link)
- “force_goal_orientation” (bool, default: true)
- “temporary_escape” (bool, default: true)
- “fast_map_update” (bool, default: false)
- “debug_mode” (string, default: std::string(“cost_estim”))
debug output data type
- “hyst”: path hysteresis cost
- “cost_estim”: estimated cost to the goal used as A* heuristic function
- “queue_size_limit” (int, default: 0)
- “antialias_start” (bool, default: false)
If enabled, the planner searches path from multiple surrounding grids within the grid size to reduce path chattering.
planner_2dof_serial_joints
planner_2dof_serial_joints provides collision avoidance for 2-DOF serial joint (e.g. controlling interfering pairs of sub-tracks for tracked vehicle.)
Subscribed topics
- ~/trajectory_in (new: trajectory_in) [trajectory_msgs::JointTrajectory]
- ~/joint (new: joint_states) [sensor_msgs::JointState]
- /tf
Published topics
- ~/trajectory_out (new: joint_trajectory) [trajectory_msgs::JointTrajectory]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
Called services
Parameters
- “resolution” (int, default: 128)
- “debug_aa” (bool, default: false)
- “replan_interval” (double, default: 0.2)
- “queue_size_limit” (int, default: 0)
- “link0_name” (string, default: std::string(“link0”))
- “link1_name” (string, default: std::string(“link1”))
- “point_vel_mode” (string, default: std::string(“prev”))
- “range” (int, default: 8)
- “num_groups” (int, default: 1)
File truncated at 100 lines see the full file
Changelog for package planner_cspace
0.18.1 (2025-06-06)
- planner_cspace: fix crowd escape to use original goal if reachable (#779)
- planner_cspace: fix error status during crowd escape (#776)
- Contributors: Atsushi Watanabe
0.18.0 (2025-05-13)
- Ignore temporary escape trigger if map is not received (#770)
- planner_cspace: crowd escape mode (#763)
- planner_cspace: fix flaky navigation tests (#768)
- Contributors: Atsushi Watanabe
0.17.7 (2025-04-16)
0.17.6 (2025-03-18)
- planner_cspace: fix flaky dynamic reconfigure test (#756)
- Contributors: Atsushi Watanabe
0.17.5 (2025-02-21)
- planner_cspace: reconstuct GridAstarModel3D only when necessary (#751)
- Contributors: Naotaka Hatao
0.17.4 (2025-01-20)
0.17.3 (2024-12-25)
- planner_cspace: add costmap_cspace integration test for out-of-bound position (#746)
- costmap_cspace: publish empty costmap_update on out-of-bound (#743)
- planner_cspace: reduce remember_updates calculation cost (#742)
- Contributors: Atsushi Watanabe
0.17.2 (2024-11-07)
- planner_3d: apply turn_penalty_cost_threshold in curve path (#739)
- Contributors: Naotaka Hatao
0.17.1 (2024-03-22)
- planner_3d: remove duplicated interpolation method (#733)
- Contributors: Naotaka Hatao
0.17.0 (2023-11-02)
- planner_3d: add an option to trigger planning by costmap updates (#727)
- planner_3d: fix cost calculation bug on in-place turning (#725)
- Contributors: Naotaka Hatao
0.16.0 (2023-09-14)
- planner_cspace: start planning from expected robot pose (#717)
- planner_cspace: add new parameters for cost function (#720)
- planner_cspace: refactor start pose building algorithm and fix finishing condition when start is relocated (#718)
- Contributors: Naotaka Hatao
0.15.0 (2023-08-30)
- planner_cspace: enable dynamic reconfigure (#714)
- planner_space: fix segmentation fault on out-of-map (#712)
- Contributors: Atsushi Watanabe, Naotaka Hatao
0.14.2 (2023-07-31)
- planner_cspace: improve peformance of DistanceMap (#709)
- planner_cspace: avoid multiple goal pose relocation (#708)
- Contributors: Naotaka Hatao
0.14.1 (2023-07-07)
- planner_cspace: fix error status handling after cost_estim_cache_ was not created (#705)
- Contributors: Naotaka Hatao
File truncated at 100 lines see the full file
Wiki Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
neonavigation | |
neonavigation_launch |
Launch files
Messages
Services
Plugins
Recent questions tagged planner_cspace at Robotics Stack Exchange
![]() |
planner_cspace package from neonavigation repocostmap_cspace joystick_interrupt map_organizer neonavigation neonavigation_common neonavigation_launch obj_to_pointcloud planner_cspace safety_limiter track_odometry trajectory_tracker |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.18.1 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/at-wat/neonavigation.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2025-06-20 |
Dev Status | DEVELOPED |
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
Additional Links
Maintainers
- Atsushi Watanabe
Authors
- Atsushi Watanabe
planner_cspace package
The topic names will be migrated to ROS recommended namespace model.
Set /neonavigation_compatible
parameter to 1
to use new topic names.
planner_3d
planner_3d node provides 2-D/3-DOF seamless global-local path and motion planner.
Subscribed topics
- ~/costmap (new: costmap) [costmap_cspace_msgs::CSpace3D]
- ~/costmap_update (new: costmap_update) [costmap_cspace_msgs::CSpace3DUpdate]
- ~/goal (new: move_base_simple/goal) [geometry_msgs::PoseStamped]
- /tf
Published topics
- ~/path (new: path) [nav_msgs::Path]
- ~/debug [sensor_msgs::PointCloud]
debug output of planner internal costmap
- ~/remembered [sensor_msgs::PointCloud]
debug output of obstacles probability estimated by BBF
- ~/path_start [geometry_msgs::PoseStamped]
- ~/path_end [geometry_msgs::PoseStamped]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
- ~/forget (new: forget_planning_cost) [std_srvs::Empty]
Called services
Parameters
- “goal_tolerance_lin” (double, default: 0.05)
- “goal_tolerance_ang” (double, default: 0.1)
- “goal_tolerance_ang_finish” (double, default: 0.05)
- “unknown_cost” (int, default: 100)
- “hist_cnt_max” (int, default: 20)
- “hist_cnt_thres” (int, default: 19)
- “hist_cost” (int, default: 90)
- “hist_ignore_range” (double, default: 1.0)
- “remember_updates” (bool, default: false)
- “local_range” (double, default: 2.5)
- “longcut_range” (double, default: 0.0)
- “esc_range” (double, default: 0.25)
- “find_best” (bool, default: true)
- “pos_jump” (double, default: 1.0)
- “yaw_jump” (double, default: 1.5)
- “jump_detect_frame” (string, default: base_link)
- “force_goal_orientation” (bool, default: true)
- “temporary_escape” (bool, default: true)
- “fast_map_update” (bool, default: false)
- “debug_mode” (string, default: std::string(“cost_estim”))
debug output data type
- “hyst”: path hysteresis cost
- “cost_estim”: estimated cost to the goal used as A* heuristic function
- “queue_size_limit” (int, default: 0)
- “antialias_start” (bool, default: false)
If enabled, the planner searches path from multiple surrounding grids within the grid size to reduce path chattering.
planner_2dof_serial_joints
planner_2dof_serial_joints provides collision avoidance for 2-DOF serial joint (e.g. controlling interfering pairs of sub-tracks for tracked vehicle.)
Subscribed topics
- ~/trajectory_in (new: trajectory_in) [trajectory_msgs::JointTrajectory]
- ~/joint (new: joint_states) [sensor_msgs::JointState]
- /tf
Published topics
- ~/trajectory_out (new: joint_trajectory) [trajectory_msgs::JointTrajectory]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
Called services
Parameters
- “resolution” (int, default: 128)
- “debug_aa” (bool, default: false)
- “replan_interval” (double, default: 0.2)
- “queue_size_limit” (int, default: 0)
- “link0_name” (string, default: std::string(“link0”))
- “link1_name” (string, default: std::string(“link1”))
- “point_vel_mode” (string, default: std::string(“prev”))
- “range” (int, default: 8)
- “num_groups” (int, default: 1)
File truncated at 100 lines see the full file
Changelog for package planner_cspace
0.18.1 (2025-06-06)
- planner_cspace: fix crowd escape to use original goal if reachable (#779)
- planner_cspace: fix error status during crowd escape (#776)
- Contributors: Atsushi Watanabe
0.18.0 (2025-05-13)
- Ignore temporary escape trigger if map is not received (#770)
- planner_cspace: crowd escape mode (#763)
- planner_cspace: fix flaky navigation tests (#768)
- Contributors: Atsushi Watanabe
0.17.7 (2025-04-16)
0.17.6 (2025-03-18)
- planner_cspace: fix flaky dynamic reconfigure test (#756)
- Contributors: Atsushi Watanabe
0.17.5 (2025-02-21)
- planner_cspace: reconstuct GridAstarModel3D only when necessary (#751)
- Contributors: Naotaka Hatao
0.17.4 (2025-01-20)
0.17.3 (2024-12-25)
- planner_cspace: add costmap_cspace integration test for out-of-bound position (#746)
- costmap_cspace: publish empty costmap_update on out-of-bound (#743)
- planner_cspace: reduce remember_updates calculation cost (#742)
- Contributors: Atsushi Watanabe
0.17.2 (2024-11-07)
- planner_3d: apply turn_penalty_cost_threshold in curve path (#739)
- Contributors: Naotaka Hatao
0.17.1 (2024-03-22)
- planner_3d: remove duplicated interpolation method (#733)
- Contributors: Naotaka Hatao
0.17.0 (2023-11-02)
- planner_3d: add an option to trigger planning by costmap updates (#727)
- planner_3d: fix cost calculation bug on in-place turning (#725)
- Contributors: Naotaka Hatao
0.16.0 (2023-09-14)
- planner_cspace: start planning from expected robot pose (#717)
- planner_cspace: add new parameters for cost function (#720)
- planner_cspace: refactor start pose building algorithm and fix finishing condition when start is relocated (#718)
- Contributors: Naotaka Hatao
0.15.0 (2023-08-30)
- planner_cspace: enable dynamic reconfigure (#714)
- planner_space: fix segmentation fault on out-of-map (#712)
- Contributors: Atsushi Watanabe, Naotaka Hatao
0.14.2 (2023-07-31)
- planner_cspace: improve peformance of DistanceMap (#709)
- planner_cspace: avoid multiple goal pose relocation (#708)
- Contributors: Naotaka Hatao
0.14.1 (2023-07-07)
- planner_cspace: fix error status handling after cost_estim_cache_ was not created (#705)
- Contributors: Naotaka Hatao
File truncated at 100 lines see the full file
Wiki Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
neonavigation | |
neonavigation_launch |
Launch files
Messages
Services
Plugins
Recent questions tagged planner_cspace at Robotics Stack Exchange
![]() |
planner_cspace package from neonavigation repocostmap_cspace joystick_interrupt map_organizer neonavigation neonavigation_common neonavigation_launch obj_to_pointcloud planner_cspace safety_limiter track_odometry trajectory_tracker |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.4.0 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/at-wat/neonavigation.git |
VCS Type | git |
VCS Version | indigo-devel |
Last Updated | 2019-05-22 |
Dev Status | DEVELOPED |
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
Additional Links
Maintainers
- Atsushi Watanabe
Authors
- Atsushi Watanabe
planner_cspace package
The topic names will be migrated to ROS recommended namespace model.
Set /neonavigation_compatible
parameter to 1
to use new topic names.
planner_3d
planner_3d node provides 2-D/3-DOF seamless global-local path and motion planner.
Subscribed topics
- ~/costmap (new: costmap) [costmap_cspace_msgs::CSpace3D]
- ~/costmap_update (new: costmap_update) [costmap_cspace_msgs::CSpace3DUpdate]
- ~/goal (new: move_base_simple/goal) [geometry_msgs::PoseStamped]
- /tf
Published topics
- ~/path (new: path) [nav_msgs::Path]
- ~/debug [sensor_msgs::PointCloud]
- ~/path_start [geometry_msgs::PoseStamped]
- ~/path_end [geometry_msgs::PoseStamped]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
- ~/forget (new: forget_planning_cost) [std_srvs::Empty]
Called services
Parameters
- “goal_tolerance_lin” (double, default: 0.05)
- “goal_tolerance_ang” (double, default: 0.1)
- “goal_tolerance_ang_finish” (double, default: 0.05)
- “unknown_cost” (int, default: 100)
- “hist_cnt_max” (int, default: 20)
- “hist_cnt_thres” (int, default: 19)
- “hist_cost” (int, default: 90)
- “hist_ignore_range” (double, default: 1.0)
- “remember_updates” (bool, default: false)
- “local_range” (double, default: 2.5)
- “longcut_range” (double, default: 0.0)
- “esc_range” (double, default: 0.25)
- “find_best” (bool, default: true)
- “pos_jump” (double, default: 1.0)
- “yaw_jump” (double, default: 1.5)
- “jump_detect_frame” (string, default: base_link)
- “force_goal_orientation” (bool, default: true)
- “temporary_escape” (bool, default: true)
- “fast_map_update” (bool, default: false)
- “debug_mode” (string, default: std::string(“cost_estim”))
- “queue_size_limit” (int, default: 0)
planner_2dof_serial_joints
planner_2dof_serial_joints provides collision avoidance for 2-DOF serial joint (e.g. controlling interfering pairs of sub-tracks for tracked vehicle.)
Subscribed topics
- ~/trajectory_in (new: trajectory_in) [trajectory_msgs::JointTrajectory]
- ~/joint (new: joint_states) [sensor_msgs::JointState]
- /tf
Published topics
- ~/trajectory_out (new: joint_trajectory) [trajectory_msgs::JointTrajectory]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
Called services
Parameters
- “resolution” (int, default: 128)
- “debug_aa” (bool, default: false)
- “replan_interval” (double, default: 0.2)
- “queue_size_limit” (int, default: 0)
- “link0_name” (string, default: std::string(“link0”))
- “link1_name” (string, default: std::string(“link1”))
- “point_vel_mode” (string, default: std::string(“prev”))
- “range” (int, default: 8)
- “num_groups” (int, default: 1)
dummy_robot
stub
patrol
File truncated at 100 lines see the full file
Changelog for package planner_cspace
0.4.0 (2019-05-09)
- planner_cspace: limit negative cost to avoid infinite search loop (#288)
- trajectory_tracker: remove unused parameters (#274)
- Support melodic (#266)
- Contributors: Atsushi Watanabe, Yuta Koga
0.3.1 (2019-01-10)
- trajectory_tracker: support PathWithVelocity (#244)
- planner_cspace: fix stability of test_costmap_watchdog (#242)
- planner_cspace: add watchdog to costmap update (#235)
- planner_cspace: add missing test dependencies (#234)
- Fix pointer alignment style (#233)
- Migrate tf to tf2 (#230)
- planner_cspace: add diagnostics to planner node (#226)
- planner_cspace: stop robot motion if new map received (#218)
- planner_cspace: split grid-metric converter functions (#213)
- planner_cspace: split motion cache class (#212)
- planner_cspace: fix goal and start tolerance parameter (#211)
- planner_cspace: add cost for turning near obstacles (#210)
- Fix catkin package definitions (#206)
- planner_cspace: use odometry position difference in jump detection (#205)
- planner_cspace: refactoring (#204)
- Contributors: Atsushi Watanabe, So Jomura, Yuta Koga
0.2.3 (2018-07-19)
- Fix test names (#202)
- Contributors: Atsushi Watanabe
0.2.2 (2018-07-17)
0.2.1 (2018-07-14)
- Fix missing package dependencies (#194)
- Contributors: Atsushi Watanabe
0.2.0 (2018-07-12)
- planner_cspace: fix restriction of path segment connection (#191)
- planner_cspace: fix boundary check (#190)
- planner_cspace: fix unconverged switching back vibration (#183)
- Reduce random test failure (#181)
- Update CI (#179)
- Fix cost in heuristic function for make_plan service (#178)
- Fix namespace migration messages (#174)
- planner_cspace: add make plan service (#169)
- Fix topic/service namespace model (#168)
- Fix package dependencies (#167)
- Fix naming styles (#166)
- Update package descriptions and unify license and version (#165)
- Use neonavigation_msgs package (#164)
- planner_cspace: fix clearing remembered costmap (#158)
- planner_cspace: fix partial costmap update with unknown cells (#156)
- planner_cspace: remember costmap using binary bayes filter (#149)
- planner_cspace: fix position jump detection (#150)
- planner_cspace: fix remembering costmap (#147)
- planner_cspace: use frame_id of incoming message to set dummy robot pose (#145)
File truncated at 100 lines see the full file
Wiki Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
neonavigation | |
neonavigation_launch |
Launch files
Messages
Services
Plugins
Recent questions tagged planner_cspace at Robotics Stack Exchange
![]() |
planner_cspace package from neonavigation repocostmap_cspace joystick_interrupt map_organizer neonavigation neonavigation_common neonavigation_launch obj_to_pointcloud planner_cspace safety_limiter track_odometry trajectory_tracker |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.18.1 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/at-wat/neonavigation.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2025-06-20 |
Dev Status | DEVELOPED |
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
Additional Links
Maintainers
- Atsushi Watanabe
Authors
- Atsushi Watanabe
planner_cspace package
The topic names will be migrated to ROS recommended namespace model.
Set /neonavigation_compatible
parameter to 1
to use new topic names.
planner_3d
planner_3d node provides 2-D/3-DOF seamless global-local path and motion planner.
Subscribed topics
- ~/costmap (new: costmap) [costmap_cspace_msgs::CSpace3D]
- ~/costmap_update (new: costmap_update) [costmap_cspace_msgs::CSpace3DUpdate]
- ~/goal (new: move_base_simple/goal) [geometry_msgs::PoseStamped]
- /tf
Published topics
- ~/path (new: path) [nav_msgs::Path]
- ~/debug [sensor_msgs::PointCloud]
debug output of planner internal costmap
- ~/remembered [sensor_msgs::PointCloud]
debug output of obstacles probability estimated by BBF
- ~/path_start [geometry_msgs::PoseStamped]
- ~/path_end [geometry_msgs::PoseStamped]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
- ~/forget (new: forget_planning_cost) [std_srvs::Empty]
Called services
Parameters
- “goal_tolerance_lin” (double, default: 0.05)
- “goal_tolerance_ang” (double, default: 0.1)
- “goal_tolerance_ang_finish” (double, default: 0.05)
- “unknown_cost” (int, default: 100)
- “hist_cnt_max” (int, default: 20)
- “hist_cnt_thres” (int, default: 19)
- “hist_cost” (int, default: 90)
- “hist_ignore_range” (double, default: 1.0)
- “remember_updates” (bool, default: false)
- “local_range” (double, default: 2.5)
- “longcut_range” (double, default: 0.0)
- “esc_range” (double, default: 0.25)
- “find_best” (bool, default: true)
- “pos_jump” (double, default: 1.0)
- “yaw_jump” (double, default: 1.5)
- “jump_detect_frame” (string, default: base_link)
- “force_goal_orientation” (bool, default: true)
- “temporary_escape” (bool, default: true)
- “fast_map_update” (bool, default: false)
- “debug_mode” (string, default: std::string(“cost_estim”))
debug output data type
- “hyst”: path hysteresis cost
- “cost_estim”: estimated cost to the goal used as A* heuristic function
- “queue_size_limit” (int, default: 0)
- “antialias_start” (bool, default: false)
If enabled, the planner searches path from multiple surrounding grids within the grid size to reduce path chattering.
planner_2dof_serial_joints
planner_2dof_serial_joints provides collision avoidance for 2-DOF serial joint (e.g. controlling interfering pairs of sub-tracks for tracked vehicle.)
Subscribed topics
- ~/trajectory_in (new: trajectory_in) [trajectory_msgs::JointTrajectory]
- ~/joint (new: joint_states) [sensor_msgs::JointState]
- /tf
Published topics
- ~/trajectory_out (new: joint_trajectory) [trajectory_msgs::JointTrajectory]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
Called services
Parameters
- “resolution” (int, default: 128)
- “debug_aa” (bool, default: false)
- “replan_interval” (double, default: 0.2)
- “queue_size_limit” (int, default: 0)
- “link0_name” (string, default: std::string(“link0”))
- “link1_name” (string, default: std::string(“link1”))
- “point_vel_mode” (string, default: std::string(“prev”))
- “range” (int, default: 8)
- “num_groups” (int, default: 1)
File truncated at 100 lines see the full file
Changelog for package planner_cspace
0.18.1 (2025-06-06)
- planner_cspace: fix crowd escape to use original goal if reachable (#779)
- planner_cspace: fix error status during crowd escape (#776)
- Contributors: Atsushi Watanabe
0.18.0 (2025-05-13)
- Ignore temporary escape trigger if map is not received (#770)
- planner_cspace: crowd escape mode (#763)
- planner_cspace: fix flaky navigation tests (#768)
- Contributors: Atsushi Watanabe
0.17.7 (2025-04-16)
0.17.6 (2025-03-18)
- planner_cspace: fix flaky dynamic reconfigure test (#756)
- Contributors: Atsushi Watanabe
0.17.5 (2025-02-21)
- planner_cspace: reconstuct GridAstarModel3D only when necessary (#751)
- Contributors: Naotaka Hatao
0.17.4 (2025-01-20)
0.17.3 (2024-12-25)
- planner_cspace: add costmap_cspace integration test for out-of-bound position (#746)
- costmap_cspace: publish empty costmap_update on out-of-bound (#743)
- planner_cspace: reduce remember_updates calculation cost (#742)
- Contributors: Atsushi Watanabe
0.17.2 (2024-11-07)
- planner_3d: apply turn_penalty_cost_threshold in curve path (#739)
- Contributors: Naotaka Hatao
0.17.1 (2024-03-22)
- planner_3d: remove duplicated interpolation method (#733)
- Contributors: Naotaka Hatao
0.17.0 (2023-11-02)
- planner_3d: add an option to trigger planning by costmap updates (#727)
- planner_3d: fix cost calculation bug on in-place turning (#725)
- Contributors: Naotaka Hatao
0.16.0 (2023-09-14)
- planner_cspace: start planning from expected robot pose (#717)
- planner_cspace: add new parameters for cost function (#720)
- planner_cspace: refactor start pose building algorithm and fix finishing condition when start is relocated (#718)
- Contributors: Naotaka Hatao
0.15.0 (2023-08-30)
- planner_cspace: enable dynamic reconfigure (#714)
- planner_space: fix segmentation fault on out-of-map (#712)
- Contributors: Atsushi Watanabe, Naotaka Hatao
0.14.2 (2023-07-31)
- planner_cspace: improve peformance of DistanceMap (#709)
- planner_cspace: avoid multiple goal pose relocation (#708)
- Contributors: Naotaka Hatao
0.14.1 (2023-07-07)
- planner_cspace: fix error status handling after cost_estim_cache_ was not created (#705)
- Contributors: Naotaka Hatao
File truncated at 100 lines see the full file
Wiki Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
neonavigation | |
neonavigation_launch |
Launch files
Messages
Services
Plugins
Recent questions tagged planner_cspace at Robotics Stack Exchange
![]() |
planner_cspace package from neonavigation repocostmap_cspace joystick_interrupt map_organizer neonavigation neonavigation_common neonavigation_launch obj_to_pointcloud planner_cspace safety_limiter track_odometry trajectory_tracker |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.18.1 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/at-wat/neonavigation.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2025-06-20 |
Dev Status | DEVELOPED |
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
Additional Links
Maintainers
- Atsushi Watanabe
Authors
- Atsushi Watanabe
planner_cspace package
The topic names will be migrated to ROS recommended namespace model.
Set /neonavigation_compatible
parameter to 1
to use new topic names.
planner_3d
planner_3d node provides 2-D/3-DOF seamless global-local path and motion planner.
Subscribed topics
- ~/costmap (new: costmap) [costmap_cspace_msgs::CSpace3D]
- ~/costmap_update (new: costmap_update) [costmap_cspace_msgs::CSpace3DUpdate]
- ~/goal (new: move_base_simple/goal) [geometry_msgs::PoseStamped]
- /tf
Published topics
- ~/path (new: path) [nav_msgs::Path]
- ~/debug [sensor_msgs::PointCloud]
debug output of planner internal costmap
- ~/remembered [sensor_msgs::PointCloud]
debug output of obstacles probability estimated by BBF
- ~/path_start [geometry_msgs::PoseStamped]
- ~/path_end [geometry_msgs::PoseStamped]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
- ~/forget (new: forget_planning_cost) [std_srvs::Empty]
Called services
Parameters
- “goal_tolerance_lin” (double, default: 0.05)
- “goal_tolerance_ang” (double, default: 0.1)
- “goal_tolerance_ang_finish” (double, default: 0.05)
- “unknown_cost” (int, default: 100)
- “hist_cnt_max” (int, default: 20)
- “hist_cnt_thres” (int, default: 19)
- “hist_cost” (int, default: 90)
- “hist_ignore_range” (double, default: 1.0)
- “remember_updates” (bool, default: false)
- “local_range” (double, default: 2.5)
- “longcut_range” (double, default: 0.0)
- “esc_range” (double, default: 0.25)
- “find_best” (bool, default: true)
- “pos_jump” (double, default: 1.0)
- “yaw_jump” (double, default: 1.5)
- “jump_detect_frame” (string, default: base_link)
- “force_goal_orientation” (bool, default: true)
- “temporary_escape” (bool, default: true)
- “fast_map_update” (bool, default: false)
- “debug_mode” (string, default: std::string(“cost_estim”))
debug output data type
- “hyst”: path hysteresis cost
- “cost_estim”: estimated cost to the goal used as A* heuristic function
- “queue_size_limit” (int, default: 0)
- “antialias_start” (bool, default: false)
If enabled, the planner searches path from multiple surrounding grids within the grid size to reduce path chattering.
planner_2dof_serial_joints
planner_2dof_serial_joints provides collision avoidance for 2-DOF serial joint (e.g. controlling interfering pairs of sub-tracks for tracked vehicle.)
Subscribed topics
- ~/trajectory_in (new: trajectory_in) [trajectory_msgs::JointTrajectory]
- ~/joint (new: joint_states) [sensor_msgs::JointState]
- /tf
Published topics
- ~/trajectory_out (new: joint_trajectory) [trajectory_msgs::JointTrajectory]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
Called services
Parameters
- “resolution” (int, default: 128)
- “debug_aa” (bool, default: false)
- “replan_interval” (double, default: 0.2)
- “queue_size_limit” (int, default: 0)
- “link0_name” (string, default: std::string(“link0”))
- “link1_name” (string, default: std::string(“link1”))
- “point_vel_mode” (string, default: std::string(“prev”))
- “range” (int, default: 8)
- “num_groups” (int, default: 1)
File truncated at 100 lines see the full file
Changelog for package planner_cspace
0.18.1 (2025-06-06)
- planner_cspace: fix crowd escape to use original goal if reachable (#779)
- planner_cspace: fix error status during crowd escape (#776)
- Contributors: Atsushi Watanabe
0.18.0 (2025-05-13)
- Ignore temporary escape trigger if map is not received (#770)
- planner_cspace: crowd escape mode (#763)
- planner_cspace: fix flaky navigation tests (#768)
- Contributors: Atsushi Watanabe
0.17.7 (2025-04-16)
0.17.6 (2025-03-18)
- planner_cspace: fix flaky dynamic reconfigure test (#756)
- Contributors: Atsushi Watanabe
0.17.5 (2025-02-21)
- planner_cspace: reconstuct GridAstarModel3D only when necessary (#751)
- Contributors: Naotaka Hatao
0.17.4 (2025-01-20)
0.17.3 (2024-12-25)
- planner_cspace: add costmap_cspace integration test for out-of-bound position (#746)
- costmap_cspace: publish empty costmap_update on out-of-bound (#743)
- planner_cspace: reduce remember_updates calculation cost (#742)
- Contributors: Atsushi Watanabe
0.17.2 (2024-11-07)
- planner_3d: apply turn_penalty_cost_threshold in curve path (#739)
- Contributors: Naotaka Hatao
0.17.1 (2024-03-22)
- planner_3d: remove duplicated interpolation method (#733)
- Contributors: Naotaka Hatao
0.17.0 (2023-11-02)
- planner_3d: add an option to trigger planning by costmap updates (#727)
- planner_3d: fix cost calculation bug on in-place turning (#725)
- Contributors: Naotaka Hatao
0.16.0 (2023-09-14)
- planner_cspace: start planning from expected robot pose (#717)
- planner_cspace: add new parameters for cost function (#720)
- planner_cspace: refactor start pose building algorithm and fix finishing condition when start is relocated (#718)
- Contributors: Naotaka Hatao
0.15.0 (2023-08-30)
- planner_cspace: enable dynamic reconfigure (#714)
- planner_space: fix segmentation fault on out-of-map (#712)
- Contributors: Atsushi Watanabe, Naotaka Hatao
0.14.2 (2023-07-31)
- planner_cspace: improve peformance of DistanceMap (#709)
- planner_cspace: avoid multiple goal pose relocation (#708)
- Contributors: Naotaka Hatao
0.14.1 (2023-07-07)
- planner_cspace: fix error status handling after cost_estim_cache_ was not created (#705)
- Contributors: Naotaka Hatao
File truncated at 100 lines see the full file
Wiki Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
neonavigation | |
neonavigation_launch |
Launch files
Messages
Services
Plugins
Recent questions tagged planner_cspace at Robotics Stack Exchange
![]() |
planner_cspace package from neonavigation repocostmap_cspace joystick_interrupt map_organizer neonavigation neonavigation_common neonavigation_launch obj_to_pointcloud planner_cspace safety_limiter track_odometry trajectory_tracker |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.18.1 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/at-wat/neonavigation.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2025-06-20 |
Dev Status | DEVELOPED |
CI status |
|
Released | RELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (0)
Good First Issues (0) Pull Requests to Review (0) |
Package Description
Additional Links
Maintainers
- Atsushi Watanabe
Authors
- Atsushi Watanabe
planner_cspace package
The topic names will be migrated to ROS recommended namespace model.
Set /neonavigation_compatible
parameter to 1
to use new topic names.
planner_3d
planner_3d node provides 2-D/3-DOF seamless global-local path and motion planner.
Subscribed topics
- ~/costmap (new: costmap) [costmap_cspace_msgs::CSpace3D]
- ~/costmap_update (new: costmap_update) [costmap_cspace_msgs::CSpace3DUpdate]
- ~/goal (new: move_base_simple/goal) [geometry_msgs::PoseStamped]
- /tf
Published topics
- ~/path (new: path) [nav_msgs::Path]
- ~/debug [sensor_msgs::PointCloud]
debug output of planner internal costmap
- ~/remembered [sensor_msgs::PointCloud]
debug output of obstacles probability estimated by BBF
- ~/path_start [geometry_msgs::PoseStamped]
- ~/path_end [geometry_msgs::PoseStamped]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
- ~/forget (new: forget_planning_cost) [std_srvs::Empty]
Called services
Parameters
- “goal_tolerance_lin” (double, default: 0.05)
- “goal_tolerance_ang” (double, default: 0.1)
- “goal_tolerance_ang_finish” (double, default: 0.05)
- “unknown_cost” (int, default: 100)
- “hist_cnt_max” (int, default: 20)
- “hist_cnt_thres” (int, default: 19)
- “hist_cost” (int, default: 90)
- “hist_ignore_range” (double, default: 1.0)
- “remember_updates” (bool, default: false)
- “local_range” (double, default: 2.5)
- “longcut_range” (double, default: 0.0)
- “esc_range” (double, default: 0.25)
- “find_best” (bool, default: true)
- “pos_jump” (double, default: 1.0)
- “yaw_jump” (double, default: 1.5)
- “jump_detect_frame” (string, default: base_link)
- “force_goal_orientation” (bool, default: true)
- “temporary_escape” (bool, default: true)
- “fast_map_update” (bool, default: false)
- “debug_mode” (string, default: std::string(“cost_estim”))
debug output data type
- “hyst”: path hysteresis cost
- “cost_estim”: estimated cost to the goal used as A* heuristic function
- “queue_size_limit” (int, default: 0)
- “antialias_start” (bool, default: false)
If enabled, the planner searches path from multiple surrounding grids within the grid size to reduce path chattering.
planner_2dof_serial_joints
planner_2dof_serial_joints provides collision avoidance for 2-DOF serial joint (e.g. controlling interfering pairs of sub-tracks for tracked vehicle.)
Subscribed topics
- ~/trajectory_in (new: trajectory_in) [trajectory_msgs::JointTrajectory]
- ~/joint (new: joint_states) [sensor_msgs::JointState]
- /tf
Published topics
- ~/trajectory_out (new: joint_trajectory) [trajectory_msgs::JointTrajectory]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
Called services
Parameters
- “resolution” (int, default: 128)
- “debug_aa” (bool, default: false)
- “replan_interval” (double, default: 0.2)
- “queue_size_limit” (int, default: 0)
- “link0_name” (string, default: std::string(“link0”))
- “link1_name” (string, default: std::string(“link1”))
- “point_vel_mode” (string, default: std::string(“prev”))
- “range” (int, default: 8)
- “num_groups” (int, default: 1)
File truncated at 100 lines see the full file
Changelog for package planner_cspace
0.18.1 (2025-06-06)
- planner_cspace: fix crowd escape to use original goal if reachable (#779)
- planner_cspace: fix error status during crowd escape (#776)
- Contributors: Atsushi Watanabe
0.18.0 (2025-05-13)
- Ignore temporary escape trigger if map is not received (#770)
- planner_cspace: crowd escape mode (#763)
- planner_cspace: fix flaky navigation tests (#768)
- Contributors: Atsushi Watanabe
0.17.7 (2025-04-16)
0.17.6 (2025-03-18)
- planner_cspace: fix flaky dynamic reconfigure test (#756)
- Contributors: Atsushi Watanabe
0.17.5 (2025-02-21)
- planner_cspace: reconstuct GridAstarModel3D only when necessary (#751)
- Contributors: Naotaka Hatao
0.17.4 (2025-01-20)
0.17.3 (2024-12-25)
- planner_cspace: add costmap_cspace integration test for out-of-bound position (#746)
- costmap_cspace: publish empty costmap_update on out-of-bound (#743)
- planner_cspace: reduce remember_updates calculation cost (#742)
- Contributors: Atsushi Watanabe
0.17.2 (2024-11-07)
- planner_3d: apply turn_penalty_cost_threshold in curve path (#739)
- Contributors: Naotaka Hatao
0.17.1 (2024-03-22)
- planner_3d: remove duplicated interpolation method (#733)
- Contributors: Naotaka Hatao
0.17.0 (2023-11-02)
- planner_3d: add an option to trigger planning by costmap updates (#727)
- planner_3d: fix cost calculation bug on in-place turning (#725)
- Contributors: Naotaka Hatao
0.16.0 (2023-09-14)
- planner_cspace: start planning from expected robot pose (#717)
- planner_cspace: add new parameters for cost function (#720)
- planner_cspace: refactor start pose building algorithm and fix finishing condition when start is relocated (#718)
- Contributors: Naotaka Hatao
0.15.0 (2023-08-30)
- planner_cspace: enable dynamic reconfigure (#714)
- planner_space: fix segmentation fault on out-of-map (#712)
- Contributors: Atsushi Watanabe, Naotaka Hatao
0.14.2 (2023-07-31)
- planner_cspace: improve peformance of DistanceMap (#709)
- planner_cspace: avoid multiple goal pose relocation (#708)
- Contributors: Naotaka Hatao
0.14.1 (2023-07-07)
- planner_cspace: fix error status handling after cost_estim_cache_ was not created (#705)
- Contributors: Naotaka Hatao
File truncated at 100 lines see the full file
Wiki Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
neonavigation | |
neonavigation_launch |
Launch files
Messages
Services
Plugins
Recent questions tagged planner_cspace at Robotics Stack Exchange
![]() |
planner_cspace package from neonavigation repocostmap_cspace joystick_interrupt map_organizer neonavigation neonavigation_common neonavigation_launch obj_to_pointcloud planner_cspace safety_limiter track_odometry trajectory_tracker |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.18.1 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/at-wat/neonavigation.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2025-06-20 |
Dev Status | DEVELOPED |
CI status |
|
Released | RELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (0)
Good First Issues (0) Pull Requests to Review (0) |
Package Description
Additional Links
Maintainers
- Atsushi Watanabe
Authors
- Atsushi Watanabe
planner_cspace package
The topic names will be migrated to ROS recommended namespace model.
Set /neonavigation_compatible
parameter to 1
to use new topic names.
planner_3d
planner_3d node provides 2-D/3-DOF seamless global-local path and motion planner.
Subscribed topics
- ~/costmap (new: costmap) [costmap_cspace_msgs::CSpace3D]
- ~/costmap_update (new: costmap_update) [costmap_cspace_msgs::CSpace3DUpdate]
- ~/goal (new: move_base_simple/goal) [geometry_msgs::PoseStamped]
- /tf
Published topics
- ~/path (new: path) [nav_msgs::Path]
- ~/debug [sensor_msgs::PointCloud]
debug output of planner internal costmap
- ~/remembered [sensor_msgs::PointCloud]
debug output of obstacles probability estimated by BBF
- ~/path_start [geometry_msgs::PoseStamped]
- ~/path_end [geometry_msgs::PoseStamped]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
- ~/forget (new: forget_planning_cost) [std_srvs::Empty]
Called services
Parameters
- “goal_tolerance_lin” (double, default: 0.05)
- “goal_tolerance_ang” (double, default: 0.1)
- “goal_tolerance_ang_finish” (double, default: 0.05)
- “unknown_cost” (int, default: 100)
- “hist_cnt_max” (int, default: 20)
- “hist_cnt_thres” (int, default: 19)
- “hist_cost” (int, default: 90)
- “hist_ignore_range” (double, default: 1.0)
- “remember_updates” (bool, default: false)
- “local_range” (double, default: 2.5)
- “longcut_range” (double, default: 0.0)
- “esc_range” (double, default: 0.25)
- “find_best” (bool, default: true)
- “pos_jump” (double, default: 1.0)
- “yaw_jump” (double, default: 1.5)
- “jump_detect_frame” (string, default: base_link)
- “force_goal_orientation” (bool, default: true)
- “temporary_escape” (bool, default: true)
- “fast_map_update” (bool, default: false)
- “debug_mode” (string, default: std::string(“cost_estim”))
debug output data type
- “hyst”: path hysteresis cost
- “cost_estim”: estimated cost to the goal used as A* heuristic function
- “queue_size_limit” (int, default: 0)
- “antialias_start” (bool, default: false)
If enabled, the planner searches path from multiple surrounding grids within the grid size to reduce path chattering.
planner_2dof_serial_joints
planner_2dof_serial_joints provides collision avoidance for 2-DOF serial joint (e.g. controlling interfering pairs of sub-tracks for tracked vehicle.)
Subscribed topics
- ~/trajectory_in (new: trajectory_in) [trajectory_msgs::JointTrajectory]
- ~/joint (new: joint_states) [sensor_msgs::JointState]
- /tf
Published topics
- ~/trajectory_out (new: joint_trajectory) [trajectory_msgs::JointTrajectory]
- ~/status [planner_cspace_msgs::PlannerStatus]
Services
Called services
Parameters
- “resolution” (int, default: 128)
- “debug_aa” (bool, default: false)
- “replan_interval” (double, default: 0.2)
- “queue_size_limit” (int, default: 0)
- “link0_name” (string, default: std::string(“link0”))
- “link1_name” (string, default: std::string(“link1”))
- “point_vel_mode” (string, default: std::string(“prev”))
- “range” (int, default: 8)
- “num_groups” (int, default: 1)
File truncated at 100 lines see the full file
Changelog for package planner_cspace
0.18.1 (2025-06-06)
- planner_cspace: fix crowd escape to use original goal if reachable (#779)
- planner_cspace: fix error status during crowd escape (#776)
- Contributors: Atsushi Watanabe
0.18.0 (2025-05-13)
- Ignore temporary escape trigger if map is not received (#770)
- planner_cspace: crowd escape mode (#763)
- planner_cspace: fix flaky navigation tests (#768)
- Contributors: Atsushi Watanabe
0.17.7 (2025-04-16)
0.17.6 (2025-03-18)
- planner_cspace: fix flaky dynamic reconfigure test (#756)
- Contributors: Atsushi Watanabe
0.17.5 (2025-02-21)
- planner_cspace: reconstuct GridAstarModel3D only when necessary (#751)
- Contributors: Naotaka Hatao
0.17.4 (2025-01-20)
0.17.3 (2024-12-25)
- planner_cspace: add costmap_cspace integration test for out-of-bound position (#746)
- costmap_cspace: publish empty costmap_update on out-of-bound (#743)
- planner_cspace: reduce remember_updates calculation cost (#742)
- Contributors: Atsushi Watanabe
0.17.2 (2024-11-07)
- planner_3d: apply turn_penalty_cost_threshold in curve path (#739)
- Contributors: Naotaka Hatao
0.17.1 (2024-03-22)
- planner_3d: remove duplicated interpolation method (#733)
- Contributors: Naotaka Hatao
0.17.0 (2023-11-02)
- planner_3d: add an option to trigger planning by costmap updates (#727)
- planner_3d: fix cost calculation bug on in-place turning (#725)
- Contributors: Naotaka Hatao
0.16.0 (2023-09-14)
- planner_cspace: start planning from expected robot pose (#717)
- planner_cspace: add new parameters for cost function (#720)
- planner_cspace: refactor start pose building algorithm and fix finishing condition when start is relocated (#718)
- Contributors: Naotaka Hatao
0.15.0 (2023-08-30)
- planner_cspace: enable dynamic reconfigure (#714)
- planner_space: fix segmentation fault on out-of-map (#712)
- Contributors: Atsushi Watanabe, Naotaka Hatao
0.14.2 (2023-07-31)
- planner_cspace: improve peformance of DistanceMap (#709)
- planner_cspace: avoid multiple goal pose relocation (#708)
- Contributors: Naotaka Hatao
0.14.1 (2023-07-07)
- planner_cspace: fix error status handling after cost_estim_cache_ was not created (#705)
- Contributors: Naotaka Hatao
File truncated at 100 lines see the full file
Wiki Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
neonavigation | |
neonavigation_launch |