$search

global_planner_switcher::GlobalPlannerSwitcher Class Reference

Inheritance diagram for global_planner_switcher::GlobalPlannerSwitcher:
Inheritance graph
[legend]

List of all members.

Public Member Functions

 GlobalPlannerSwitcher (std::string name, costmap_2d::Costmap2DROS *costmap_ros)
 GlobalPlannerSwitcher ()
void initialize (std::string name, costmap_2d::Costmap2DROS *costmap_ros)
virtual bool makePlan (const geometry_msgs::PoseStamped &start, const geometry_msgs::PoseStamped &goal, std::vector< geometry_msgs::PoseStamped > &plan)
 ~GlobalPlannerSwitcher ()

Private Member Functions

void comp_ctor (const std::string &name)
void setPlannerCB (const std_msgs::String &msg)

Private Attributes

ros::Publisher active_planner_pub_
ros::Subscriber active_planner_sub_
navfn::NavfnROSnavfn_planner_
ros::NodeHandle nh_
bool sbpl_active_
SBPLCartPlannersbpl_planner_

Detailed Description

Definition at line 12 of file global_planner_switcher.cpp.


Constructor & Destructor Documentation

global_planner_switcher::GlobalPlannerSwitcher::GlobalPlannerSwitcher (  )  [inline]

Definition at line 15 of file global_planner_switcher.cpp.

global_planner_switcher::GlobalPlannerSwitcher::GlobalPlannerSwitcher ( std::string  name,
costmap_2d::Costmap2DROS costmap_ros 
) [inline]

Definition at line 24 of file global_planner_switcher.cpp.

global_planner_switcher::GlobalPlannerSwitcher::~GlobalPlannerSwitcher (  )  [inline]

Definition at line 49 of file global_planner_switcher.cpp.


Member Function Documentation

void global_planner_switcher::GlobalPlannerSwitcher::comp_ctor ( const std::string &  name  )  [inline, private]

Definition at line 77 of file global_planner_switcher.cpp.

void global_planner_switcher::GlobalPlannerSwitcher::initialize ( std::string  name,
costmap_2d::Costmap2DROS costmap_ros 
) [inline, virtual]

Implements nav_core::BaseGlobalPlanner.

Definition at line 32 of file global_planner_switcher.cpp.

virtual bool global_planner_switcher::GlobalPlannerSwitcher::makePlan ( const geometry_msgs::PoseStamped start,
const geometry_msgs::PoseStamped goal,
std::vector< geometry_msgs::PoseStamped > &  plan 
) [inline, virtual]

Implements nav_core::BaseGlobalPlanner.

Definition at line 39 of file global_planner_switcher.cpp.

void global_planner_switcher::GlobalPlannerSwitcher::setPlannerCB ( const std_msgs::String &  msg  )  [inline, private]

Definition at line 61 of file global_planner_switcher.cpp.


Member Data Documentation

Definition at line 93 of file global_planner_switcher.cpp.

Definition at line 92 of file global_planner_switcher.cpp.

Definition at line 57 of file global_planner_switcher.cpp.

Definition at line 59 of file global_planner_switcher.cpp.

Definition at line 90 of file global_planner_switcher.cpp.

Definition at line 56 of file global_planner_switcher.cpp.


The documentation for this class was generated from the following file:
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Properties Friends


global_planner_switcher
Author(s): Kevin Watts
autogenerated on Fri Mar 1 14:56:18 2013