38 #include <rclcpp/logger.hpp>
39 #include <rclcpp/logging.hpp>
53 const std::string& group_name)
54 : is_valid_(false), scene_(scene), jmg_(scene->getRobotModel()->getJointModelGroup(group_name)), verbose_(false)
58 RCLCPP_ERROR(
getLogger(),
"A JointModelGroup should have been specified for the constraint sampler");
65 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.
rclcpp::Logger getLogger()
The constraint samplers namespace contains a number of methods for generating samples based on a cons...
rclcpp::Logger getLogger(const std::string &name)
Creates a namespaced logger.