File tree Expand file tree Collapse file tree 1 file changed +2
-1
lines changed Expand file tree Collapse file tree 1 file changed +2
-1
lines changed Original file line number Diff line number Diff line change 3939#include < moveit_msgs/WorkspaceParameters.h>
4040
4141namespace py = pybind11;
42+ using namespace py ::literals;
4243using namespace moveit ::task_constructor;
4344using namespace moveit ::task_constructor::solvers;
4445
@@ -79,7 +80,7 @@ void export_solvers(py::module& m) {
7980 .property <double >(" goal_orientation_tolerance" , " float: Tolerance for reaching orientation goals" )
8081 .property <bool >(" display_motion_plans" , " bool: Publish generated solutions via a topic" )
8182 .property <bool >(" publish_planning_requests" , " bool: Publish motion planning requests via a topic" )
82- .def (py::init<>( ));
83+ .def (py::init<const std::string&>(), " pipeline " _a = std::string ( " ompl " ));
8384
8485 properties::class_<JointInterpolationPlanner, PlannerInterface>(
8586 m, " JointInterpolationPlanner" ,
You can’t perform that action at this time.
0 commit comments