Public Member Functions | |
std::vector< std::string > | getKnownObjectNames (bool with_type) |
std::vector< std::string > | getKnownObjectNamesInROI (double minx, double miny, double minz, double maxx, double maxy, double maxz, bool with_type) |
PlanningSceneInterfaceImpl () | |
Private Attributes | |
ros::NodeHandle | node_handle_ |
ros::ServiceClient | planning_scene_service_ |
robot_model::RobotModelConstPtr | robot_model_ |
Definition at line 47 of file planning_scene_interface.cpp.
moveit::planning_interface::PlanningSceneInterface::PlanningSceneInterfaceImpl::PlanningSceneInterfaceImpl | ( | ) | [inline] |
Definition at line 51 of file planning_scene_interface.cpp.
std::vector<std::string> moveit::planning_interface::PlanningSceneInterface::PlanningSceneInterfaceImpl::getKnownObjectNames | ( | bool | with_type | ) | [inline] |
Definition at line 56 of file planning_scene_interface.cpp.
std::vector<std::string> moveit::planning_interface::PlanningSceneInterface::PlanningSceneInterfaceImpl::getKnownObjectNamesInROI | ( | double | minx, |
double | miny, | ||
double | minz, | ||
double | maxx, | ||
double | maxy, | ||
double | maxz, | ||
bool | with_type | ||
) | [inline] |
Definition at line 78 of file planning_scene_interface.cpp.
ros::NodeHandle moveit::planning_interface::PlanningSceneInterface::PlanningSceneInterfaceImpl::node_handle_ [private] |
Definition at line 124 of file planning_scene_interface.cpp.
ros::ServiceClient moveit::planning_interface::PlanningSceneInterface::PlanningSceneInterfaceImpl::planning_scene_service_ [private] |
Definition at line 125 of file planning_scene_interface.cpp.
robot_model::RobotModelConstPtr moveit::planning_interface::PlanningSceneInterface::PlanningSceneInterfaceImpl::robot_model_ [private] |
Definition at line 126 of file planning_scene_interface.cpp.