#include <std_msgs/Header.h>#include <sensor_msgs/CameraInfo.h>#include <geometry_msgs/PointStamped.h>#include <tf/transform_listener.h>#include <pcl16/point_cloud.h>#include <pcl16/point_types.h>#include <pcl16/common/eigen.h>#include <pcl16/common/io.h>#include <pcl16/ModelCoefficients.h>#include <opencv2/core/core.hpp>#include <vector>#include <deque>#include <string>#include <math.h>#include <boost/shared_ptr.hpp>

Go to the source code of this file.
Classes | |
| class | tabletop_pushing::PointCloudSegmentation |
| class | tabletop_pushing::ProtoObject |
Namespaces | |
| namespace | tabletop_pushing |
Typedefs | |
| typedef pcl16::PointCloud < pcl16::Normal > | tabletop_pushing::NormalCloud |
| typedef std::deque< ProtoObject > | tabletop_pushing::ProtoObjects |
| typedef pcl16::PointCloud < pcl16::PointXYZ > | tabletop_pushing::XYZPointCloud |
Functions | |
| void | tabletop_pushing::getMaskedPointCloud (XYZPointCloud &input_cloud, cv::Mat &mask, XYZPointCloud &masked_cloud) |