#include <chomp_planner.h>
Public Member Functions | |
ChompPlanner () | |
bool | solve (const planning_scene::PlanningSceneConstPtr &planning_scene, const moveit_msgs::MotionPlanRequest &req, const ChompParameters ¶ms, moveit_msgs::MotionPlanDetailedResponse &res) const |
virtual | ~ChompPlanner () |
Definition at line 47 of file chomp_planner.h.
Definition at line 46 of file chomp_planner.cpp.
virtual chomp::ChompPlanner::~ChompPlanner | ( | ) | [inline, virtual] |
Definition at line 51 of file chomp_planner.h.
bool chomp::ChompPlanner::solve | ( | const planning_scene::PlanningSceneConstPtr & | planning_scene, |
const moveit_msgs::MotionPlanRequest & | req, | ||
const ChompParameters & | params, | ||
moveit_msgs::MotionPlanDetailedResponse & | res | ||
) | const |
Definition at line 50 of file chomp_planner.cpp.