moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
This is the complete list of members for moveit::semantic_world::SemanticWorld, including all inherited members.
addTableCallback(const TableCallbackFn &table_callback) | moveit::semantic_world::SemanticWorld | inline |
addTablesToCollisionWorld() | moveit::semantic_world::SemanticWorld | |
clear() | moveit::semantic_world::SemanticWorld | |
findObjectTable(const geometry_msgs::msg::Pose &pose, double min_distance_from_edge=0.0, double min_vertical_offset=0.0) const | moveit::semantic_world::SemanticWorld | |
generatePlacePoses(const std::string &table_name, const shapes::ShapeConstPtr &object_shape, const geometry_msgs::msg::Quaternion &object_orientation, double resolution, double delta_height=0.01, unsigned int num_heights=2) const | moveit::semantic_world::SemanticWorld | |
generatePlacePoses(const object_recognition_msgs::msg::Table &table, const shapes::ShapeConstPtr &object_shape, const geometry_msgs::msg::Quaternion &object_orientation, double resolution, double delta_height=0.01, unsigned int num_heights=2) const | moveit::semantic_world::SemanticWorld | |
generatePlacePoses(const object_recognition_msgs::msg::Table &table, double resolution, double height_above_table, double delta_height=0.01, unsigned int num_heights=2, double min_distance_from_edge=0.10) const | moveit::semantic_world::SemanticWorld | |
getPlaceLocationsMarker(const std::vector< geometry_msgs::msg::PoseStamped > &poses) const | moveit::semantic_world::SemanticWorld | |
getTableNamesInROI(double minx, double miny, double minz, double maxx, double maxy, double maxz) const | moveit::semantic_world::SemanticWorld | |
getTablesInROI(double minx, double miny, double minz, double maxx, double maxy, double maxz) const | moveit::semantic_world::SemanticWorld | |
isInsideTableContour(const geometry_msgs::msg::Pose &pose, const object_recognition_msgs::msg::Table &table, double min_distance_from_edge=0.0, double min_vertical_offset=0.0) const | moveit::semantic_world::SemanticWorld | |
SemanticWorld(const rclcpp::Node::SharedPtr &node, const planning_scene::PlanningSceneConstPtr &planning_scene) | moveit::semantic_world::SemanticWorld | |
TableCallbackFn typedef | moveit::semantic_world::SemanticWorld |