37 #include <pybind11/pybind11.h>
38 #include <pybind11/numpy.h>
39 #include <pybind11/eigen.h>
40 #include <pybind11/stl.h>
52 m.doc() =
"Class for joint, position, visibility, and other constraints";
54 py::class_<ConstraintEvaluationResult, std::shared_ptr<ConstraintEvaluationResult>>(m,
"ConstraintEvaluationResult")
61 py::class_<KinematicConstraintSet, KinematicConstraintSetPtr>(m,
"KinematicConstraintSet")
62 .def(py::init<robot_model::RobotModelConstPtr>(), py::arg(
"robot_model"))
63 .def(
"add", py::overload_cast<const moveit_msgs::Constraints&, const moveit::core::Transforms&>(
67 py::arg(
"state"), py::arg(
"verbose") =
false)
71 m.def(
"constructGoalConstraints",
72 py::overload_cast<const std::string&, const geometry_msgs::PoseStamped&, double, double>(
74 py::arg(
"link_name"), py::arg(
"pose"), py::arg(
"tolerance_pos") = 1e-3, py::arg(
"tolerance_angle") = 1e-2)