Classes | Defines | Typedefs
moving_object_filter.h File Reference
#include <ros/ros.h>
#include <pcl_ros/point_cloud.h>
#include <sensor_msgs/Image.h>
#include <sensor_msgs/image_encodings.h>
#include <cv_bridge/cv_bridge.h>
#include <message_filters/subscriber.h>
#include <message_filters/time_synchronizer.h>
#include <message_filters/sync_policies/approximate_time.h>
#include <image_transport/image_transport.h>
#include <image_transport/subscriber_filter.h>
#include <iostream>
#include <stdio.h>
#include <vector>
#include <string>
#include <ctime>
#include <opencv2/opencv.hpp>
#include <opencv2/core/core.hpp>
#include <opencv2/features2d/features2d.hpp>
#include <opencv2/calib3d/calib3d.hpp>
#include <opencv2/nonfree/nonfree.hpp>
#include <opencv2/nonfree/features2d.hpp>
#include <opencv2/imgproc/imgproc.hpp>
#include <opencv2/highgui/highgui.hpp>
#include <eigen3/Eigen/Core>
#include <eigen3/Eigen/Dense>
#include <eigen3/Eigen/Eigen>
#include <pcl/point_cloud.h>
#include <pcl/point_types.h>
#include <pcl/common/time.h>
#include <pcl/visualization/cloud_viewer.h>
#include <pcl/ModelCoefficients.h>
#include <pcl/sample_consensus/method_types.h>
#include <pcl/sample_consensus/model_types.h>
#include <pcl/segmentation/sac_segmentation.h>
#include <pcl/segmentation/extract_clusters.h>
#include <pcl/common/impl/angles.hpp>
#include <pcl/filters/passthrough.h>
#include <pcl/filters/voxel_grid.h>
#include <pcl/filters/extract_indices.h>
#include <pcl/filters/statistical_outlier_removal.h>
#include <pcl/pcl_base.h>
#include <pcl/surface/concave_hull.h>
#include <pcl/surface/convex_hull.h>
#include <pcl/segmentation/extract_polygonal_prism_data.h>
#include <cstring>
Include dependency graph for moving_object_filter.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  MovingObjectFilter

Defines

#define threshod_binary   30

Typedefs

typedef pcl::PointCloud
< pcl::PointXYZRGB > 
cloud_type
typedef pcl::PointXYZRGB point_type

Define Documentation

#define threshod_binary   30

Definition at line 69 of file moving_object_filter.h.


Typedef Documentation

typedef pcl::PointCloud<pcl::PointXYZRGB> cloud_type

Definition at line 67 of file moving_object_filter.h.

typedef pcl::PointXYZRGB point_type

Definition at line 66 of file moving_object_filter.h.



micros_dynamic_objects_filter
Author(s):
autogenerated on Thu Jun 6 2019 17:55:18