38 #include <rclcpp/logger.hpp>
39 #include <rclcpp/logging.hpp>
43 static const rclcpp::Logger LOGGER = rclcpp::get_logger(
"moveit_constraint_samplers.constraint_sampler");
46 const std::string& group_name)
47 : is_valid_(false), scene_(
scene), jmg_(
scene->getRobotModel()->getJointModelGroup(group_name)), verbose_(false)
51 RCLCPP_ERROR(LOGGER,
"A JointModelGroup should have been specified for the constraint sampler");
58 frame_depends_.clear();
ConstraintSampler(const planning_scene::PlanningSceneConstPtr &scene, const std::string &group_name)
Constructor.
const moveit::core::JointModelGroup *const jmg_
Holds the joint model group associated with this constraint.
virtual void clear()
Clears all data from the constraint.
The constraint samplers namespace contains a number of methods for generating samples based on a cons...