#include <collvoid_simple_global_planner.h>

Public Member Functions | |
| CollvoidSimpleGlobalPlanner () | |
| CollvoidSimpleGlobalPlanner (std::string name, costmap_2d::Costmap2DROS *costmap_ros) | |
| void | initialize (std::string name, costmap_2d::Costmap2DROS *costmap_ros) | 
| bool | makePlan (const geometry_msgs::PoseStamped &start, const geometry_msgs::PoseStamped &goal, std::vector< geometry_msgs::PoseStamped > &plan) | 
Definition at line 49 of file collvoid_simple_global_planner.h.
Definition at line 46 of file collvoid_simple_global_planner.cpp.
| collvoid_simple_global_planner::CollvoidSimpleGlobalPlanner::CollvoidSimpleGlobalPlanner | ( | std::string | name, | 
| costmap_2d::Costmap2DROS * | costmap_ros | ||
| ) | 
Definition at line 49 of file collvoid_simple_global_planner.cpp.
| void collvoid_simple_global_planner::CollvoidSimpleGlobalPlanner::initialize | ( | std::string | name, | 
| costmap_2d::Costmap2DROS * | costmap_ros | ||
| ) |  [virtual] | 
        
Implements nav_core::BaseGlobalPlanner.
Definition at line 54 of file collvoid_simple_global_planner.cpp.
| bool collvoid_simple_global_planner::CollvoidSimpleGlobalPlanner::makePlan | ( | const geometry_msgs::PoseStamped & | start, | 
| const geometry_msgs::PoseStamped & | goal, | ||
| std::vector< geometry_msgs::PoseStamped > & | plan | ||
| ) |  [virtual] | 
        
Implements nav_core::BaseGlobalPlanner.
Definition at line 57 of file collvoid_simple_global_planner.cpp.