17 #ifndef CARTESIANPATHCONSTRAINTSBUILDER_H 18 #define CARTESIANPATHCONSTRAINTSBUILDER_H 22 #include <moveit_msgs/Constraints.h> 60 moveit_msgs::PositionConstraint pos_constraint;
66 path_constraints.position_constraints.push_back(pos_constraint);
67 return path_constraints;
72 #endif // CARTESIANPATHCONSTRAINTSBUILDER_H CartesianConfiguration configuration_
std::string constraint_name_
Helper class to build moveit_msgs::Constraints from a given configuration.
const geometry_msgs::Pose & getPose() const
moveit_msgs::Constraints toPathConstraints() const
CartesianPathConstraintsBuilder & setConstraintName(const std::string &constraint_name)
CartesianPathConstraintsBuilder & setConfiguration(const CartesianConfiguration &configuration)
Class to define a robot configuration in space with the help of cartesian coordinates.
const std::string & getLinkName() const