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 48 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 58 of file sbpl_meta_plugin.cpp.
std::string sbpl_interface_ros::SBPLMetaPlanner::getDescription | ( | ) | const [inline] |
Definition at line 95 of file sbpl_meta_plugin.cpp.
void sbpl_interface_ros::SBPLMetaPlanner::getPlanningAlgorithms | ( | std::vector< std::string > & | algs | ) | const [inline] |
Definition at line 97 of file sbpl_meta_plugin.cpp.
void sbpl_interface_ros::SBPLMetaPlanner::init | ( | const planning_models::RobotModelConstPtr & | model | ) | [inline] |
Definition at line 51 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 66 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 76 of file sbpl_meta_plugin.cpp.
void sbpl_interface_ros::SBPLMetaPlanner::terminate | ( | ) | const [inline] |
Definition at line 103 of file sbpl_meta_plugin.cpp.
Definition at line 109 of file sbpl_meta_plugin.cpp.
boost::shared_ptr<sbpl_interface::SBPLMetaInterface> sbpl_interface_ros::SBPLMetaPlanner::sbpl_meta_interface_ [private] |
Definition at line 110 of file sbpl_meta_plugin.cpp.