1 #ifndef RAIL_SEGMENTATION_BOUNDING_VOLUME_CALCULATOR_H 2 #define RAIL_SEGMENTATION_BOUNDING_VOLUME_CALCULATOR_H 5 #include <rail_manipulation_msgs/BoundingVolume.h> 7 #include <sensor_msgs/PointCloud2.h> 10 #include <pcl/common/common.h> 11 #include <pcl/common/transforms.h> 12 #include <pcl/filters/project_inliers.h> 13 #include <pcl/point_cloud.h> 14 #include <pcl/point_types.h> 36 static rail_manipulation_msgs::BoundingVolume
computeBoundingVolume(pcl::PointCloud<pcl::PointXYZRGB>::Ptr cloud);
43 static rail_manipulation_msgs::BoundingVolume
computeBoundingVolume(pcl::PointCloud<pcl::PointXYZ>::Ptr cloud);
46 #endif // RAIL_SEGMENTATION_BOUNDING_VOLUME_CALCULATOR_H static rail_manipulation_msgs::BoundingVolume computeBoundingVolume(sensor_msgs::PointCloud2 cloud)
Fit a z-axis-aligned bounding box to x-y plane principal direction of point cloud.
Static functions to compute point cloud bounding boxes for pick-and-place.