#include <constraint_sampler_allocator.h>
Public Member Functions | |
virtual ConstraintSamplerPtr | alloc (const planning_scene::PlanningSceneConstPtr &scene, const std::string &group_name, const moveit_msgs::Constraints &constr)=0 |
virtual bool | canService (const planning_scene::PlanningSceneConstPtr &scene, const std::string &group_name, const moveit_msgs::Constraints &constr) const =0 |
ConstraintSamplerAllocator () | |
virtual | ~ConstraintSamplerAllocator () |
Definition at line 45 of file constraint_sampler_allocator.h.
Definition at line 49 of file constraint_sampler_allocator.h.
virtual constraint_samplers::ConstraintSamplerAllocator::~ConstraintSamplerAllocator | ( | ) | [inline, virtual] |
Definition at line 53 of file constraint_sampler_allocator.h.
virtual ConstraintSamplerPtr constraint_samplers::ConstraintSamplerAllocator::alloc | ( | const planning_scene::PlanningSceneConstPtr & | scene, |
const std::string & | group_name, | ||
const moveit_msgs::Constraints & | constr | ||
) | [pure virtual] |
virtual bool constraint_samplers::ConstraintSamplerAllocator::canService | ( | const planning_scene::PlanningSceneConstPtr & | scene, |
const std::string & | group_name, | ||
const moveit_msgs::Constraints & | constr | ||
) | const [pure virtual] |