| Public Member Functions | |
| bool | canServiceRequest (const moveit_msgs::GetMotionPlan::Request &req, planning_interface::PlannerCapability &capabilities) const | 
| std::string | getDescription () const | 
| void | getPlanningAlgorithms (std::vector< std::string > &algs) const | 
| void | init (const planning_models::RobotModelConstPtr &model) | 
| bool | solve (const planning_scene::PlanningSceneConstPtr &planning_scene, const moveit_msgs::GetMotionPlan::Request &req, moveit_msgs::GetMotionPlan::Response &res) const | 
| bool | solve (const planning_scene::PlanningSceneConstPtr &planning_scene, const moveit_msgs::GetMotionPlan::Request &req, moveit_msgs::MotionPlanDetailedResponse &res) const | 
| void | terminate () const | 
| Private Attributes | |
| ros::Publisher | display_bfs_publisher_ | 
| boost::shared_ptr < sbpl_interface::SBPLMetaInterface > | sbpl_meta_interface_ | 
Definition at line 49 of file sbpl_meta_plugin.cpp.
| bool sbpl_interface_ros::SBPLMetaPlanner::canServiceRequest | ( | const moveit_msgs::GetMotionPlan::Request & | req, | 
| planning_interface::PlannerCapability & | capabilities | ||
| ) | const  [inline] | 
Definition at line 59 of file sbpl_meta_plugin.cpp.
| std::string sbpl_interface_ros::SBPLMetaPlanner::getDescription | ( | ) | const  [inline] | 
Definition at line 96 of file sbpl_meta_plugin.cpp.
| void sbpl_interface_ros::SBPLMetaPlanner::getPlanningAlgorithms | ( | std::vector< std::string > & | algs | ) | const  [inline] | 
Definition at line 98 of file sbpl_meta_plugin.cpp.
| void sbpl_interface_ros::SBPLMetaPlanner::init | ( | const planning_models::RobotModelConstPtr & | model | ) |  [inline] | 
Definition at line 52 of file sbpl_meta_plugin.cpp.
| bool sbpl_interface_ros::SBPLMetaPlanner::solve | ( | const planning_scene::PlanningSceneConstPtr & | planning_scene, | 
| const moveit_msgs::GetMotionPlan::Request & | req, | ||
| moveit_msgs::GetMotionPlan::Response & | res | ||
| ) | const  [inline] | 
Definition at line 67 of file sbpl_meta_plugin.cpp.
| bool sbpl_interface_ros::SBPLMetaPlanner::solve | ( | const planning_scene::PlanningSceneConstPtr & | planning_scene, | 
| const moveit_msgs::GetMotionPlan::Request & | req, | ||
| moveit_msgs::MotionPlanDetailedResponse & | res | ||
| ) | const  [inline] | 
Definition at line 77 of file sbpl_meta_plugin.cpp.
| void sbpl_interface_ros::SBPLMetaPlanner::terminate | ( | ) | const  [inline] | 
Definition at line 104 of file sbpl_meta_plugin.cpp.
Definition at line 110 of file sbpl_meta_plugin.cpp.
| boost::shared_ptr<sbpl_interface::SBPLMetaInterface> sbpl_interface_ros::SBPLMetaPlanner::sbpl_meta_interface_  [private] | 
Definition at line 111 of file sbpl_meta_plugin.cpp.