Go to the documentation of this file.00001
00002
00003
00004
00005
00006
00007
00008
00009
00010
00011
00012
00013
00014
00015
00016
00017
00018
00019
00020
00021
00022
00023
00024
00025
00026
00027
00028
00029
00030
00031
00032
00033
00034
00035
00036
00037 #include <moveit/constraint_samplers/constraint_sampler_allocator.h>
00038 #include <pluginlib/class_list_macros.h>
00039
00040 namespace pr2_constraint_sampler
00041 {
00042
00043
00044 class PR2ConstraintSampler : public constraint_samplers::ConstraintSampler
00045 {
00046 public:
00047
00048 PR2ConstraintSampler(const planning_scene::PlanningSceneConstPtr &scene, const std::string &group_name) : constraint_samplers::ConstraintSampler(scene, group_name)
00049 {
00050 }
00051
00052 virtual bool configure(const moveit_msgs::Constraints &constr)
00053 {
00054 return false;
00055 }
00056
00057 virtual bool sample(planning_models::RobotState *::JointStateGroup *jsg, const planning_models::RobotState& reference_state, unsigned int max_attempts)
00058 {
00059 return false;
00060 }
00061
00062 };
00063
00064
00065 class PR2ConstraintSamplerAllocator : public constraint_samplers::ConstraintSamplerAllocator
00066 {
00067 public:
00068
00069 virtual constraint_samplers::ConstraintSamplerPtr alloc(const planning_scene::PlanningSceneConstPtr &scene, const std::string &group_name, const moveit_msgs::Constraints &constr)
00070 {
00071 constraint_samplers::ConstraintSamplerPtr cs(new PR2ConstraintSampler(scene, group_name));
00072 cs->configure(constr);
00073 return cs;
00074 }
00075
00076 virtual bool canService(const planning_scene::PlanningSceneConstPtr &scene, const std::string &group_name, const moveit_msgs::Constraints &constr) const
00077 {
00078 return false;
00079 }
00080
00081 };
00082
00083 }
00084
00085 PLUGINLIB_EXPORT_CLASS(pr2_constraint_sampler::PR2ConstraintSamplerAllocator,
00086 constraint_samplers::ConstraintSamplerAllocator);