We read every piece of feedback, and take your input very seriously.
To see all available qualifiers, see our documentation.
There was an error while loading. Please reload this page.
1 parent d59acdb commit 1daef93Copy full SHA for 1daef93
core/python/bindings/src/stages.cpp
@@ -116,7 +116,10 @@ void export_stages(pybind11::module& m) {
116
117
.. _CollisionObject: https://docs.ros.org/en/melodic/api/moveit_msgs/html/msg/CollisionObject.html
118
119
- )", "collision_object"_a);
+ )", "collision_object"_a)
120
+ .def("removeObject", &ModifyPlanningScene::removeObject,
121
+ "Remove a CollisionObject_ from the planning scene", "name"_a)
122
+ ;
123
124
properties::class_<CurrentState, Stage>(m, "CurrentState", R"(
125
Fetch the current PlanningScene / real robot state via the ``get_planning_scene`` service.
0 commit comments