#include <chomp_planner.h>
Public Member Functions | |
ChompPlanner (const planning_models::RobotModelConstPtr &kmodel) | |
bool | solve (const planning_scene::PlanningSceneConstPtr &planning_scene, const moveit_msgs::GetMotionPlan::Request &req, const ChompParameters ¶ms, moveit_msgs::GetMotionPlan::Response &res) const |
virtual | ~ChompPlanner () |
Definition at line 46 of file chomp_planner.h.
chomp::ChompPlanner::ChompPlanner | ( | const planning_models::RobotModelConstPtr & | kmodel | ) |
Definition at line 45 of file chomp_planner.cpp.
virtual chomp::ChompPlanner::~ChompPlanner | ( | ) | [inline, virtual] |
Definition at line 50 of file chomp_planner.h.
bool chomp::ChompPlanner::solve | ( | const planning_scene::PlanningSceneConstPtr & | planning_scene, |
const moveit_msgs::GetMotionPlan::Request & | req, | ||
const ChompParameters & | params, | ||
moveit_msgs::GetMotionPlan::Response & | res | ||
) | const |
Definition at line 49 of file chomp_planner.cpp.