#include <sbpl_interface.h>
Public Member Functions | |
const PlanningStatistics & | getLastPlanningStatistics () const |
SBPLInterface (const planning_models::RobotModelConstPtr &kmodel) | |
bool | solve (const planning_scene::PlanningSceneConstPtr &planning_scene, const moveit_msgs::GetMotionPlan::Request &req, moveit_msgs::GetMotionPlan::Response &res, const PlanningParameters ¶ms) const |
virtual | ~SBPLInterface () |
Protected Attributes | |
PlanningStatistics | last_planning_statistics_ |
Definition at line 45 of file sbpl_interface.h.
sbpl_interface::SBPLInterface::SBPLInterface | ( | const planning_models::RobotModelConstPtr & | kmodel | ) | [inline] |
Definition at line 49 of file sbpl_interface.h.
virtual sbpl_interface::SBPLInterface::~SBPLInterface | ( | ) | [inline, virtual] |
Definition at line 50 of file sbpl_interface.h.
const PlanningStatistics& sbpl_interface::SBPLInterface::getLastPlanningStatistics | ( | ) | const [inline] |
Definition at line 57 of file sbpl_interface.h.
bool sbpl_interface::SBPLInterface::solve | ( | const planning_scene::PlanningSceneConstPtr & | planning_scene, |
const moveit_msgs::GetMotionPlan::Request & | req, | ||
moveit_msgs::GetMotionPlan::Response & | res, | ||
const PlanningParameters & | params | ||
) | const |
Definition at line 42 of file sbpl_interface.cpp.
Definition at line 63 of file sbpl_interface.h.