Namespaces | Functions
shape_extraction.h File Reference
#include <shape_msgs/SolidPrimitive.h>
#include <geometry_msgs/Pose.h>
#include <pcl/point_types.h>
#include <pcl_ros/point_cloud.h>
Include dependency graph for shape_extraction.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Namespaces

namespace  simple_grasping

Functions

bool simple_grasping::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 simple_grasping::extractShape (const pcl::PointCloud< pcl::PointXYZRGB > &input, const pcl::ModelCoefficients::Ptr model, pcl::PointCloud< pcl::PointXYZRGB > &output, shape_msgs::SolidPrimitive &shape, geometry_msgs::Pose &pose)
 Find the smallest shape primitive we can fit around this object, given the plane parameters.
bool simple_grasping::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 bounding box will be oriented with the frame of the cloud.


simple_grasping
Author(s): Michael Ferguson
autogenerated on Thu Jun 6 2019 19:12:06