32 #ifndef SIMPLE_GRASPING_SHAPE_EXTRACTION_H 33 #define SIMPLE_GRASPING_SHAPE_EXTRACTION_H 35 #include <shape_msgs/SolidPrimitive.h> 36 #include <geometry_msgs/Pose.h> 38 #include <pcl/point_types.h> 52 bool extractShape(
const pcl::PointCloud<pcl::PointXYZRGB>& input,
53 pcl::PointCloud<pcl::PointXYZRGB>& output,
54 shape_msgs::SolidPrimitive& shape,
55 geometry_msgs::Pose&
pose);
67 bool extractShape(
const pcl::PointCloud<pcl::PointXYZRGB>& input,
68 const pcl::ModelCoefficients::Ptr model,
69 pcl::PointCloud<pcl::PointXYZRGB>& output,
70 shape_msgs::SolidPrimitive& shape,
71 geometry_msgs::Pose&
pose);
82 shape_msgs::SolidPrimitive& shape,
83 geometry_msgs::Pose&
pose);
87 #endif // SIMPLE_GRASPING_SHAPE_EXTRACTION_H bool extractShape(const pcl::PointCloud< pcl::PointXYZRGB > &input, pcl::PointCloud< pcl::PointXYZRGB > &output, shape_msgs::SolidPrimitive &shape, geometry_msgs::Pose &pose)
Find the smallest shape primitive we can fit around this object.
bool extractUnorientedBoundingBox(const pcl::PointCloud< pcl::PointXYZRGB > &input, shape_msgs::SolidPrimitive &shape, geometry_msgs::Pose &pose)
Find a bounding box around a cloud. This method does not attempt to find best orientation and so the ...