#include <object_manipulation_tools/grasp_planners/OverheadGraspPlanner.h>#include <sensor_msgs/PointCloud.h>#include <sensor_msgs/PointCloud2.h>#include <sensor_msgs/point_cloud_conversion.h>#include <pcl/point_cloud.h>#include <pcl_ros/point_cloud.h>#include <tf/LinearMath/Scalar.h>#include <ros/console.h>#include <tf_conversions/tf_eigen.h>#include <pcl/common/transforms.h>#include <pcl/ModelCoefficients.h>#include <pcl/surface/convex_hull.h>#include <pcl/segmentation/extract_clusters.h>#include <pcl/filters/passthrough.h>#include <pcl/filters/project_inliers.h>#include <pcl/filters/extract_indices.h>#include <cmath>
Go to the source code of this file.
Typedefs | |
| typedef pcl::PointCloud < pcl::PointXYZ > | PclCloud |
| typedef pcl::PointCloud<pcl::PointXYZ> PclCloud |
Definition at line 27 of file OverheadGraspPlanner.cpp.