RAPP Platform  v0.6.0
RAPP Platform is a collection of ROS nodes and back-end processes that aim to deliver ready-to-use generic services to robots
 All Classes Namespaces Files Functions Variables Macros
path_planner.h
Go to the documentation of this file.
1 #ifndef RAPP_PATH_PLANNER_NODE
2 #define RAPP_PATH_PLANNER_NODE
3 
4 #include <string>
5 #include <geometry_msgs/PoseStamped.h>
6 #include <nav_msgs/Path.h>
7 
13 {
14  public:
15 
19  PathPlanner(void);
20 
28  std::string setSequenceNR(ros::NodeHandle &nh_, int pathPlanningThreads_);
39  bool configureSequence(std::string seq_nr, std::string map_path, std::string robot_type, std::string algorithm, ros::NodeHandle &nh_);
40 
56  navfn::MakeNavPlanResponse startSequence(std::string seq_nr, geometry_msgs::PoseStamped request_start, geometry_msgs::PoseStamped request_goal, ros::NodeHandle &nh_);
57 
59 //
60 // OLD APPROACH
61 //
63 
89  private:
90 
91 
92 };
93 
94 #endif
95 
Class that implements a path planning algorithm based on global_planner and map_server ROS nodes...
Definition: path_planner.h:12
std::string setSequenceNR(ros::NodeHandle &nh_, int pathPlanningThreads_)
Determines next planning seqence (which global_planner and map_server should be used) ...
Definition: path_planner.cpp:9
bool configureSequence(std::string seq_nr, std::string map_path, std::string robot_type, std::string algorithm, ros::NodeHandle &nh_)
Configures sequence. Sets map, approprate costmap parameters for specified robot type, sets global_planner to use detemined algorithm.
PathPlanner(void)
Default constructor.
Definition: path_planner.cpp:4
navfn::MakeNavPlanResponse startSequence(std::string seq_nr, geometry_msgs::PoseStamped request_start, geometry_msgs::PoseStamped request_goal, ros::NodeHandle &nh_)
Starts planning service of determined planning sequence.