![]() |
ike_planner package from ike_nav repoike_controller ike_costmap_2d ike_launch ike_localization ike_map_server ike_nav ike_nav_msgs ike_nav_parameters ike_nav_rviz_plugins ike_nav_server ike_planner ike_waypoint_follower |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | Apache-2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | Simple ROS 2 Navigation Stack with C++ Implementation |
Checkout URI | https://github.com/uhobeike/ike_nav.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2023-12-19 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | tracking robot localization planner cpp robotics simulation controller ros planning lidar navigation-system ros2 contol navigation-stack ros2-humble ros-humble |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Tatsuhiro Ikebe
Authors
ike_planner
Package overview
A*1およびDijkstra2探索のROS 2 C++実装です。
地図上nav_msgs/OccupancyGrid
での自己位置geometry_msgs/PoseStamped
から、与えられた目標位置geometry_msgs/PoseStamped
までの最短経路nav_msgs/Path
を求めます。
Input / Output
Input
Name(Topic) | Type | Description |
---|---|---|
/costmap_2d |
nav_msgs::msg::OccupancyGrid |
すべてのレイヤーを統合したコストマップ |
Name(Service) | Type | Description |
---|---|---|
/get_path |
ike_nav_msgs::srv::GetPath |
ロボットの姿勢と目標位置を入力 |
Output
Name(Topic) | Type | Description |
---|---|---|
/plan_path |
nav_msgs::msg::Path |
求めた最短経路 |
/planner_searched_map |
nav_msgs::msg::OccupancyGrid |
最短経路を求めるのに探索したエリア |
Name(Service) | Type | Description |
---|---|---|
/get_path |
ike_nav_msgs::srv::GetPath |
ロボットの姿勢と目標位置間の最短経路を出力 |
Parameters
Name(Parameter) | Type | Description |
---|---|---|
use_dijkstra |
bool |
Dijkstra法で最短経路を求めるか |
publish_searched_map |
int |
探索エリアをパブリッシュするか |
update_path_weight |
double |
経路のスムージングのために、データをどれだけ元からずらすかの重み |
smooth_path_weight |
double |
経路をどれだけ、スムージングするかの重み |
iteration_delta_threshold |
double |
反復の閾値 |
Reference
LICENSE
Apache License, Version 2.0に基づいています。
Citation
-
P. E. Hart, N. J. Nilsson and B. Raphael: ‘‘A Formal Basis for the Heuristic Determination of Minimum Cost Paths,’’ in IEEE Transactions on Systems Science and Cybernetics, vol. 4, no. 2, pp. 100-107, July 1968. ↩
-
E. W. Dijkstra: ‘‘A note on two problems in connexion with graphs,’’ Numer. Math., vol. 1, no. 1, pp. 269–271, Dec 1959. ↩
Package Dependencies
Deps | Name |
---|---|
ament_cmake_auto | |
ament_lint_auto | |
ament_lint_common | |
rclcpp | |
rclcpp_components | |
geometry_msgs | |
ike_map_server | |
ike_nav_msgs | |
nav_msgs | |
ike_nav_parameters |
System Dependencies
Dependant Packages
Name | Deps |
---|---|
ike_controller | |
ike_launch | |
ike_nav | |
ike_nav_server |
Launch files
Messages
Services
Plugins
Recent questions tagged ike_planner at Robotics Stack Exchange
![]() |
ike_planner package from ike_nav repoike_controller ike_costmap_2d ike_launch ike_localization ike_map_server ike_nav ike_nav_msgs ike_nav_parameters ike_nav_rviz_plugins ike_nav_server ike_planner ike_waypoint_follower |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | Apache-2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | Simple ROS 2 Navigation Stack with C++ Implementation |
Checkout URI | https://github.com/uhobeike/ike_nav.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2023-12-19 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | tracking robot localization planner cpp robotics simulation controller ros planning lidar navigation-system ros2 contol navigation-stack ros2-humble ros-humble |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Tatsuhiro Ikebe
Authors
ike_planner
Package overview
A*1およびDijkstra2探索のROS 2 C++実装です。
地図上nav_msgs/OccupancyGrid
での自己位置geometry_msgs/PoseStamped
から、与えられた目標位置geometry_msgs/PoseStamped
までの最短経路nav_msgs/Path
を求めます。
Input / Output
Input
Name(Topic) | Type | Description |
---|---|---|
/costmap_2d |
nav_msgs::msg::OccupancyGrid |
すべてのレイヤーを統合したコストマップ |
Name(Service) | Type | Description |
---|---|---|
/get_path |
ike_nav_msgs::srv::GetPath |
ロボットの姿勢と目標位置を入力 |
Output
Name(Topic) | Type | Description |
---|---|---|
/plan_path |
nav_msgs::msg::Path |
求めた最短経路 |
/planner_searched_map |
nav_msgs::msg::OccupancyGrid |
最短経路を求めるのに探索したエリア |
Name(Service) | Type | Description |
---|---|---|
/get_path |
ike_nav_msgs::srv::GetPath |
ロボットの姿勢と目標位置間の最短経路を出力 |
Parameters
Name(Parameter) | Type | Description |
---|---|---|
use_dijkstra |
bool |
Dijkstra法で最短経路を求めるか |
publish_searched_map |
int |
探索エリアをパブリッシュするか |
update_path_weight |
double |
経路のスムージングのために、データをどれだけ元からずらすかの重み |
smooth_path_weight |
double |
経路をどれだけ、スムージングするかの重み |
iteration_delta_threshold |
double |
反復の閾値 |
Reference
LICENSE
Apache License, Version 2.0に基づいています。
Citation
-
P. E. Hart, N. J. Nilsson and B. Raphael: ‘‘A Formal Basis for the Heuristic Determination of Minimum Cost Paths,’’ in IEEE Transactions on Systems Science and Cybernetics, vol. 4, no. 2, pp. 100-107, July 1968. ↩
-
E. W. Dijkstra: ‘‘A note on two problems in connexion with graphs,’’ Numer. Math., vol. 1, no. 1, pp. 269–271, Dec 1959. ↩
Package Dependencies
Deps | Name |
---|---|
ament_cmake_auto | |
ament_lint_auto | |
ament_lint_common | |
rclcpp | |
rclcpp_components | |
geometry_msgs | |
ike_map_server | |
ike_nav_msgs | |
nav_msgs | |
ike_nav_parameters |
System Dependencies
Dependant Packages
Name | Deps |
---|---|
ike_controller | |
ike_launch | |
ike_nav | |
ike_nav_server |
Launch files
Messages
Services
Plugins
Recent questions tagged ike_planner at Robotics Stack Exchange
![]() |
ike_planner package from ike_nav repoike_controller ike_costmap_2d ike_launch ike_localization ike_map_server ike_nav ike_nav_msgs ike_nav_parameters ike_nav_rviz_plugins ike_nav_server ike_planner ike_waypoint_follower |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | Apache-2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | Simple ROS 2 Navigation Stack with C++ Implementation |
Checkout URI | https://github.com/uhobeike/ike_nav.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2023-12-19 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | tracking robot localization planner cpp robotics simulation controller ros planning lidar navigation-system ros2 contol navigation-stack ros2-humble ros-humble |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Tatsuhiro Ikebe
Authors
ike_planner
Package overview
A*1およびDijkstra2探索のROS 2 C++実装です。
地図上nav_msgs/OccupancyGrid
での自己位置geometry_msgs/PoseStamped
から、与えられた目標位置geometry_msgs/PoseStamped
までの最短経路nav_msgs/Path
を求めます。
Input / Output
Input
Name(Topic) | Type | Description |
---|---|---|
/costmap_2d |
nav_msgs::msg::OccupancyGrid |
すべてのレイヤーを統合したコストマップ |
Name(Service) | Type | Description |
---|---|---|
/get_path |
ike_nav_msgs::srv::GetPath |
ロボットの姿勢と目標位置を入力 |
Output
Name(Topic) | Type | Description |
---|---|---|
/plan_path |
nav_msgs::msg::Path |
求めた最短経路 |
/planner_searched_map |
nav_msgs::msg::OccupancyGrid |
最短経路を求めるのに探索したエリア |
Name(Service) | Type | Description |
---|---|---|
/get_path |
ike_nav_msgs::srv::GetPath |
ロボットの姿勢と目標位置間の最短経路を出力 |
Parameters
Name(Parameter) | Type | Description |
---|---|---|
use_dijkstra |
bool |
Dijkstra法で最短経路を求めるか |
publish_searched_map |
int |
探索エリアをパブリッシュするか |
update_path_weight |
double |
経路のスムージングのために、データをどれだけ元からずらすかの重み |
smooth_path_weight |
double |
経路をどれだけ、スムージングするかの重み |
iteration_delta_threshold |
double |
反復の閾値 |
Reference
LICENSE
Apache License, Version 2.0に基づいています。
Citation
-
P. E. Hart, N. J. Nilsson and B. Raphael: ‘‘A Formal Basis for the Heuristic Determination of Minimum Cost Paths,’’ in IEEE Transactions on Systems Science and Cybernetics, vol. 4, no. 2, pp. 100-107, July 1968. ↩
-
E. W. Dijkstra: ‘‘A note on two problems in connexion with graphs,’’ Numer. Math., vol. 1, no. 1, pp. 269–271, Dec 1959. ↩
Package Dependencies
Deps | Name |
---|---|
ament_cmake_auto | |
ament_lint_auto | |
ament_lint_common | |
rclcpp | |
rclcpp_components | |
geometry_msgs | |
ike_map_server | |
ike_nav_msgs | |
nav_msgs | |
ike_nav_parameters |
System Dependencies
Dependant Packages
Name | Deps |
---|---|
ike_controller | |
ike_launch | |
ike_nav | |
ike_nav_server |
Launch files
Messages
Services
Plugins
Recent questions tagged ike_planner at Robotics Stack Exchange
![]() |
ike_planner package from ike_nav repoike_controller ike_costmap_2d ike_launch ike_localization ike_map_server ike_nav ike_nav_msgs ike_nav_parameters ike_nav_rviz_plugins ike_nav_server ike_planner ike_waypoint_follower |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | Apache-2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | Simple ROS 2 Navigation Stack with C++ Implementation |
Checkout URI | https://github.com/uhobeike/ike_nav.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2023-12-19 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | tracking robot localization planner cpp robotics simulation controller ros planning lidar navigation-system ros2 contol navigation-stack ros2-humble ros-humble |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Tatsuhiro Ikebe
Authors
ike_planner
Package overview
A*1およびDijkstra2探索のROS 2 C++実装です。
地図上nav_msgs/OccupancyGrid
での自己位置geometry_msgs/PoseStamped
から、与えられた目標位置geometry_msgs/PoseStamped
までの最短経路nav_msgs/Path
を求めます。
Input / Output
Input
Name(Topic) | Type | Description |
---|---|---|
/costmap_2d |
nav_msgs::msg::OccupancyGrid |
すべてのレイヤーを統合したコストマップ |
Name(Service) | Type | Description |
---|---|---|
/get_path |
ike_nav_msgs::srv::GetPath |
ロボットの姿勢と目標位置を入力 |
Output
Name(Topic) | Type | Description |
---|---|---|
/plan_path |
nav_msgs::msg::Path |
求めた最短経路 |
/planner_searched_map |
nav_msgs::msg::OccupancyGrid |
最短経路を求めるのに探索したエリア |
Name(Service) | Type | Description |
---|---|---|
/get_path |
ike_nav_msgs::srv::GetPath |
ロボットの姿勢と目標位置間の最短経路を出力 |
Parameters
Name(Parameter) | Type | Description |
---|---|---|
use_dijkstra |
bool |
Dijkstra法で最短経路を求めるか |
publish_searched_map |
int |
探索エリアをパブリッシュするか |
update_path_weight |
double |
経路のスムージングのために、データをどれだけ元からずらすかの重み |
smooth_path_weight |
double |
経路をどれだけ、スムージングするかの重み |
iteration_delta_threshold |
double |
反復の閾値 |
Reference
LICENSE
Apache License, Version 2.0に基づいています。
Citation
-
P. E. Hart, N. J. Nilsson and B. Raphael: ‘‘A Formal Basis for the Heuristic Determination of Minimum Cost Paths,’’ in IEEE Transactions on Systems Science and Cybernetics, vol. 4, no. 2, pp. 100-107, July 1968. ↩
-
E. W. Dijkstra: ‘‘A note on two problems in connexion with graphs,’’ Numer. Math., vol. 1, no. 1, pp. 269–271, Dec 1959. ↩
Package Dependencies
Deps | Name |
---|---|
ament_cmake_auto | |
ament_lint_auto | |
ament_lint_common | |
rclcpp | |
rclcpp_components | |
geometry_msgs | |
ike_map_server | |
ike_nav_msgs | |
nav_msgs | |
ike_nav_parameters |
System Dependencies
Dependant Packages
Name | Deps |
---|---|
ike_controller | |
ike_launch | |
ike_nav | |
ike_nav_server |
Launch files
Messages
Services
Plugins
Recent questions tagged ike_planner at Robotics Stack Exchange
![]() |
ike_planner package from ike_nav repoike_controller ike_costmap_2d ike_launch ike_localization ike_map_server ike_nav ike_nav_msgs ike_nav_parameters ike_nav_rviz_plugins ike_nav_server ike_planner ike_waypoint_follower |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | Apache-2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | Simple ROS 2 Navigation Stack with C++ Implementation |
Checkout URI | https://github.com/uhobeike/ike_nav.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2023-12-19 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | tracking robot localization planner cpp robotics simulation controller ros planning lidar navigation-system ros2 contol navigation-stack ros2-humble ros-humble |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Tatsuhiro Ikebe
Authors
ike_planner
Package overview
A*1およびDijkstra2探索のROS 2 C++実装です。
地図上nav_msgs/OccupancyGrid
での自己位置geometry_msgs/PoseStamped
から、与えられた目標位置geometry_msgs/PoseStamped
までの最短経路nav_msgs/Path
を求めます。
Input / Output
Input
Name(Topic) | Type | Description |
---|---|---|
/costmap_2d |
nav_msgs::msg::OccupancyGrid |
すべてのレイヤーを統合したコストマップ |
Name(Service) | Type | Description |
---|---|---|
/get_path |
ike_nav_msgs::srv::GetPath |
ロボットの姿勢と目標位置を入力 |
Output
Name(Topic) | Type | Description |
---|---|---|
/plan_path |
nav_msgs::msg::Path |
求めた最短経路 |
/planner_searched_map |
nav_msgs::msg::OccupancyGrid |
最短経路を求めるのに探索したエリア |
Name(Service) | Type | Description |
---|---|---|
/get_path |
ike_nav_msgs::srv::GetPath |
ロボットの姿勢と目標位置間の最短経路を出力 |
Parameters
Name(Parameter) | Type | Description |
---|---|---|
use_dijkstra |
bool |
Dijkstra法で最短経路を求めるか |
publish_searched_map |
int |
探索エリアをパブリッシュするか |
update_path_weight |
double |
経路のスムージングのために、データをどれだけ元からずらすかの重み |
smooth_path_weight |
double |
経路をどれだけ、スムージングするかの重み |
iteration_delta_threshold |
double |
反復の閾値 |
Reference
LICENSE
Apache License, Version 2.0に基づいています。
Citation
-
P. E. Hart, N. J. Nilsson and B. Raphael: ‘‘A Formal Basis for the Heuristic Determination of Minimum Cost Paths,’’ in IEEE Transactions on Systems Science and Cybernetics, vol. 4, no. 2, pp. 100-107, July 1968. ↩
-
E. W. Dijkstra: ‘‘A note on two problems in connexion with graphs,’’ Numer. Math., vol. 1, no. 1, pp. 269–271, Dec 1959. ↩
Package Dependencies
Deps | Name |
---|---|
ament_cmake_auto | |
ament_lint_auto | |
ament_lint_common | |
rclcpp | |
rclcpp_components | |
geometry_msgs | |
ike_map_server | |
ike_nav_msgs | |
nav_msgs | |
ike_nav_parameters |
System Dependencies
Dependant Packages
Name | Deps |
---|---|
ike_controller | |
ike_launch | |
ike_nav | |
ike_nav_server |
Launch files
Messages
Services
Plugins
Recent questions tagged ike_planner at Robotics Stack Exchange
![]() |
ike_planner package from ike_nav repoike_controller ike_costmap_2d ike_launch ike_localization ike_map_server ike_nav ike_nav_msgs ike_nav_parameters ike_nav_rviz_plugins ike_nav_server ike_planner ike_waypoint_follower |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | Apache-2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | Simple ROS 2 Navigation Stack with C++ Implementation |
Checkout URI | https://github.com/uhobeike/ike_nav.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2023-12-19 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | tracking robot localization planner cpp robotics simulation controller ros planning lidar navigation-system ros2 contol navigation-stack ros2-humble ros-humble |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Tatsuhiro Ikebe
Authors
ike_planner
Package overview
A*1およびDijkstra2探索のROS 2 C++実装です。
地図上nav_msgs/OccupancyGrid
での自己位置geometry_msgs/PoseStamped
から、与えられた目標位置geometry_msgs/PoseStamped
までの最短経路nav_msgs/Path
を求めます。
Input / Output
Input
Name(Topic) | Type | Description |
---|---|---|
/costmap_2d |
nav_msgs::msg::OccupancyGrid |
すべてのレイヤーを統合したコストマップ |
Name(Service) | Type | Description |
---|---|---|
/get_path |
ike_nav_msgs::srv::GetPath |
ロボットの姿勢と目標位置を入力 |
Output
Name(Topic) | Type | Description |
---|---|---|
/plan_path |
nav_msgs::msg::Path |
求めた最短経路 |
/planner_searched_map |
nav_msgs::msg::OccupancyGrid |
最短経路を求めるのに探索したエリア |
Name(Service) | Type | Description |
---|---|---|
/get_path |
ike_nav_msgs::srv::GetPath |
ロボットの姿勢と目標位置間の最短経路を出力 |
Parameters
Name(Parameter) | Type | Description |
---|---|---|
use_dijkstra |
bool |
Dijkstra法で最短経路を求めるか |
publish_searched_map |
int |
探索エリアをパブリッシュするか |
update_path_weight |
double |
経路のスムージングのために、データをどれだけ元からずらすかの重み |
smooth_path_weight |
double |
経路をどれだけ、スムージングするかの重み |
iteration_delta_threshold |
double |
反復の閾値 |
Reference
LICENSE
Apache License, Version 2.0に基づいています。
Citation
-
P. E. Hart, N. J. Nilsson and B. Raphael: ‘‘A Formal Basis for the Heuristic Determination of Minimum Cost Paths,’’ in IEEE Transactions on Systems Science and Cybernetics, vol. 4, no. 2, pp. 100-107, July 1968. ↩
-
E. W. Dijkstra: ‘‘A note on two problems in connexion with graphs,’’ Numer. Math., vol. 1, no. 1, pp. 269–271, Dec 1959. ↩
Package Dependencies
Deps | Name |
---|---|
ament_cmake_auto | |
ament_lint_auto | |
ament_lint_common | |
rclcpp | |
rclcpp_components | |
geometry_msgs | |
ike_map_server | |
ike_nav_msgs | |
nav_msgs | |
ike_nav_parameters |
System Dependencies
Dependant Packages
Name | Deps |
---|---|
ike_controller | |
ike_launch | |
ike_nav | |
ike_nav_server |
Launch files
Messages
Services
Plugins
Recent questions tagged ike_planner at Robotics Stack Exchange
![]() |
ike_planner package from ike_nav repoike_controller ike_costmap_2d ike_launch ike_localization ike_map_server ike_nav ike_nav_msgs ike_nav_parameters ike_nav_rviz_plugins ike_nav_server ike_planner ike_waypoint_follower |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | Apache-2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | Simple ROS 2 Navigation Stack with C++ Implementation |
Checkout URI | https://github.com/uhobeike/ike_nav.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2023-12-19 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | tracking robot localization planner cpp robotics simulation controller ros planning lidar navigation-system ros2 contol navigation-stack ros2-humble ros-humble |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Tatsuhiro Ikebe
Authors
ike_planner
Package overview
A*1およびDijkstra2探索のROS 2 C++実装です。
地図上nav_msgs/OccupancyGrid
での自己位置geometry_msgs/PoseStamped
から、与えられた目標位置geometry_msgs/PoseStamped
までの最短経路nav_msgs/Path
を求めます。
Input / Output
Input
Name(Topic) | Type | Description |
---|---|---|
/costmap_2d |
nav_msgs::msg::OccupancyGrid |
すべてのレイヤーを統合したコストマップ |
Name(Service) | Type | Description |
---|---|---|
/get_path |
ike_nav_msgs::srv::GetPath |
ロボットの姿勢と目標位置を入力 |
Output
Name(Topic) | Type | Description |
---|---|---|
/plan_path |
nav_msgs::msg::Path |
求めた最短経路 |
/planner_searched_map |
nav_msgs::msg::OccupancyGrid |
最短経路を求めるのに探索したエリア |
Name(Service) | Type | Description |
---|---|---|
/get_path |
ike_nav_msgs::srv::GetPath |
ロボットの姿勢と目標位置間の最短経路を出力 |
Parameters
Name(Parameter) | Type | Description |
---|---|---|
use_dijkstra |
bool |
Dijkstra法で最短経路を求めるか |
publish_searched_map |
int |
探索エリアをパブリッシュするか |
update_path_weight |
double |
経路のスムージングのために、データをどれだけ元からずらすかの重み |
smooth_path_weight |
double |
経路をどれだけ、スムージングするかの重み |
iteration_delta_threshold |
double |
反復の閾値 |
Reference
LICENSE
Apache License, Version 2.0に基づいています。
Citation
-
P. E. Hart, N. J. Nilsson and B. Raphael: ‘‘A Formal Basis for the Heuristic Determination of Minimum Cost Paths,’’ in IEEE Transactions on Systems Science and Cybernetics, vol. 4, no. 2, pp. 100-107, July 1968. ↩
-
E. W. Dijkstra: ‘‘A note on two problems in connexion with graphs,’’ Numer. Math., vol. 1, no. 1, pp. 269–271, Dec 1959. ↩
Package Dependencies
Deps | Name |
---|---|
ament_cmake_auto | |
ament_lint_auto | |
ament_lint_common | |
rclcpp | |
rclcpp_components | |
geometry_msgs | |
ike_map_server | |
ike_nav_msgs | |
nav_msgs | |
ike_nav_parameters |
System Dependencies
Dependant Packages
Name | Deps |
---|---|
ike_controller | |
ike_launch | |
ike_nav | |
ike_nav_server |
Launch files
Messages
Services
Plugins
Recent questions tagged ike_planner at Robotics Stack Exchange
![]() |
ike_planner package from ike_nav repoike_controller ike_costmap_2d ike_launch ike_localization ike_map_server ike_nav ike_nav_msgs ike_nav_parameters ike_nav_rviz_plugins ike_nav_server ike_planner ike_waypoint_follower |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | Apache-2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | Simple ROS 2 Navigation Stack with C++ Implementation |
Checkout URI | https://github.com/uhobeike/ike_nav.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2023-12-19 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | tracking robot localization planner cpp robotics simulation controller ros planning lidar navigation-system ros2 contol navigation-stack ros2-humble ros-humble |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Tatsuhiro Ikebe
Authors
ike_planner
Package overview
A*1およびDijkstra2探索のROS 2 C++実装です。
地図上nav_msgs/OccupancyGrid
での自己位置geometry_msgs/PoseStamped
から、与えられた目標位置geometry_msgs/PoseStamped
までの最短経路nav_msgs/Path
を求めます。
Input / Output
Input
Name(Topic) | Type | Description |
---|---|---|
/costmap_2d |
nav_msgs::msg::OccupancyGrid |
すべてのレイヤーを統合したコストマップ |
Name(Service) | Type | Description |
---|---|---|
/get_path |
ike_nav_msgs::srv::GetPath |
ロボットの姿勢と目標位置を入力 |
Output
Name(Topic) | Type | Description |
---|---|---|
/plan_path |
nav_msgs::msg::Path |
求めた最短経路 |
/planner_searched_map |
nav_msgs::msg::OccupancyGrid |
最短経路を求めるのに探索したエリア |
Name(Service) | Type | Description |
---|---|---|
/get_path |
ike_nav_msgs::srv::GetPath |
ロボットの姿勢と目標位置間の最短経路を出力 |
Parameters
Name(Parameter) | Type | Description |
---|---|---|
use_dijkstra |
bool |
Dijkstra法で最短経路を求めるか |
publish_searched_map |
int |
探索エリアをパブリッシュするか |
update_path_weight |
double |
経路のスムージングのために、データをどれだけ元からずらすかの重み |
smooth_path_weight |
double |
経路をどれだけ、スムージングするかの重み |
iteration_delta_threshold |
double |
反復の閾値 |
Reference
LICENSE
Apache License, Version 2.0に基づいています。
Citation
-
P. E. Hart, N. J. Nilsson and B. Raphael: ‘‘A Formal Basis for the Heuristic Determination of Minimum Cost Paths,’’ in IEEE Transactions on Systems Science and Cybernetics, vol. 4, no. 2, pp. 100-107, July 1968. ↩
-
E. W. Dijkstra: ‘‘A note on two problems in connexion with graphs,’’ Numer. Math., vol. 1, no. 1, pp. 269–271, Dec 1959. ↩
Package Dependencies
Deps | Name |
---|---|
ament_cmake_auto | |
ament_lint_auto | |
ament_lint_common | |
rclcpp | |
rclcpp_components | |
geometry_msgs | |
ike_map_server | |
ike_nav_msgs | |
nav_msgs | |
ike_nav_parameters |
System Dependencies
Dependant Packages
Name | Deps |
---|---|
ike_controller | |
ike_launch | |
ike_nav | |
ike_nav_server |
Launch files
Messages
Services
Plugins
Recent questions tagged ike_planner at Robotics Stack Exchange
![]() |
ike_planner package from ike_nav repoike_controller ike_costmap_2d ike_launch ike_localization ike_map_server ike_nav ike_nav_msgs ike_nav_parameters ike_nav_rviz_plugins ike_nav_server ike_planner ike_waypoint_follower |
ROS Distro
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | Apache-2.0 |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Description | Simple ROS 2 Navigation Stack with C++ Implementation |
Checkout URI | https://github.com/uhobeike/ike_nav.git |
VCS Type | git |
VCS Version | main |
Last Updated | 2023-12-19 |
Dev Status | UNKNOWN |
Released | UNRELEASED |
Tags | tracking robot localization planner cpp robotics simulation controller ros planning lidar navigation-system ros2 contol navigation-stack ros2-humble ros-humble |
Contributing |
Help Wanted (-)
Good First Issues (-) Pull Requests to Review (-) |
Package Description
Additional Links
Maintainers
- Tatsuhiro Ikebe
Authors
ike_planner
Package overview
A*1およびDijkstra2探索のROS 2 C++実装です。
地図上nav_msgs/OccupancyGrid
での自己位置geometry_msgs/PoseStamped
から、与えられた目標位置geometry_msgs/PoseStamped
までの最短経路nav_msgs/Path
を求めます。
Input / Output
Input
Name(Topic) | Type | Description |
---|---|---|
/costmap_2d |
nav_msgs::msg::OccupancyGrid |
すべてのレイヤーを統合したコストマップ |
Name(Service) | Type | Description |
---|---|---|
/get_path |
ike_nav_msgs::srv::GetPath |
ロボットの姿勢と目標位置を入力 |
Output
Name(Topic) | Type | Description |
---|---|---|
/plan_path |
nav_msgs::msg::Path |
求めた最短経路 |
/planner_searched_map |
nav_msgs::msg::OccupancyGrid |
最短経路を求めるのに探索したエリア |
Name(Service) | Type | Description |
---|---|---|
/get_path |
ike_nav_msgs::srv::GetPath |
ロボットの姿勢と目標位置間の最短経路を出力 |
Parameters
Name(Parameter) | Type | Description |
---|---|---|
use_dijkstra |
bool |
Dijkstra法で最短経路を求めるか |
publish_searched_map |
int |
探索エリアをパブリッシュするか |
update_path_weight |
double |
経路のスムージングのために、データをどれだけ元からずらすかの重み |
smooth_path_weight |
double |
経路をどれだけ、スムージングするかの重み |
iteration_delta_threshold |
double |
反復の閾値 |
Reference
LICENSE
Apache License, Version 2.0に基づいています。
Citation
-
P. E. Hart, N. J. Nilsson and B. Raphael: ‘‘A Formal Basis for the Heuristic Determination of Minimum Cost Paths,’’ in IEEE Transactions on Systems Science and Cybernetics, vol. 4, no. 2, pp. 100-107, July 1968. ↩
-
E. W. Dijkstra: ‘‘A note on two problems in connexion with graphs,’’ Numer. Math., vol. 1, no. 1, pp. 269–271, Dec 1959. ↩
Package Dependencies
Deps | Name |
---|---|
ament_cmake_auto | |
ament_lint_auto | |
ament_lint_common | |
rclcpp | |
rclcpp_components | |
geometry_msgs | |
ike_map_server | |
ike_nav_msgs | |
nav_msgs | |
ike_nav_parameters |
System Dependencies
Dependant Packages
Name | Deps |
---|---|
ike_controller | |
ike_launch | |
ike_nav | |
ike_nav_server |