Skip to content

Commit 0a502ce

Browse files
committed
Add path_constraints property to Connect stage
1 parent 721ff35 commit 0a502ce

File tree

1 file changed

+5
-0
lines changed

1 file changed

+5
-0
lines changed

core/python/bindings/src/stages.cpp

Lines changed: 5 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -328,6 +328,11 @@ void export_stages(pybind11::module& m) {
328328
)")
329329
.property<stages::Connect::MergeMode>("merge_mode", "Defines the merge strategy to use")
330330
.property<double>("max_distance", "maximally accepted distance between end and goal sate")
331+
.property<moveit_msgs::Constraints>("path_constraints", R"(
332+
Constraints_: These are the path constraints.
333+
334+
.. _Constraints: https://docs.ros.org/en/api/moveit_msgs/html/msg/Constraints.html
335+
)")
331336
.def(py::init<const std::string&, const Connect::GroupPlannerVector&>(),
332337
"name"_a = std::string("connect"), "planners"_a);
333338

0 commit comments

Comments
 (0)