Static functions to compute point cloud bounding boxes for pick-and-place. More...
#include <bounding_volume_calculator.h>
Static Public Member Functions | |
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. More... | |
static rail_manipulation_msgs::BoundingVolume | computeBoundingVolume (pcl::PointCloud< pcl::PointXYZRGB >::Ptr cloud) |
Fit a z-axis-aligned bounding box to x-y plane principal direction of point cloud. More... | |
static rail_manipulation_msgs::BoundingVolume | computeBoundingVolume (pcl::PointCloud< pcl::PointXYZ >::Ptr cloud) |
Fit a z-axis-aligned bounding box to x-y plane principal direction of point cloud. More... | |
Static functions to compute point cloud bounding boxes for pick-and-place.
Definition at line 19 of file bounding_volume_calculator.h.
|
static |
Fit a z-axis-aligned bounding box to x-y plane principal direction of point cloud.
cloud | point cloud to bound |
Definition at line 3 of file bounding_volume_calculator.cpp.
|
static |
Fit a z-axis-aligned bounding box to x-y plane principal direction of point cloud.
cloud | point cloud to bound |
Definition at line 15 of file bounding_volume_calculator.cpp.
|
static |
Fit a z-axis-aligned bounding box to x-y plane principal direction of point cloud.
cloud | point cloud to bound |
Definition at line 24 of file bounding_volume_calculator.cpp.