#include <iostream>#include "ros/ros.h"#include "nav_msgs/Odometry.h"#include <pcl/io/io.h>#include <pcl/io/pcd_io.h>#include <pcl_ros/point_cloud.h>#include <pcl/point_types.h>#include <pcl/filters/voxel_grid.h>#include <pcl/filters/filter.h>#include <pcl_conversions/pcl_conversions.h>#include "pcl_ros/transforms.h"#include <tf/tf.h>#include <tf/transform_listener.h>#include <message_filters/subscriber.h>#include <message_filters/synchronizer.h>#include <message_filters/sync_policies/approximate_time.h>
Go to the source code of this file.
Classes | |
| class | testPointCloud::tp |
Namespaces | |
| namespace | testPointCloud |
Typedefs | |
| typedef sync_policies::ApproximateTime < sensor_msgs::PointCloud2, nav_msgs::Odometry > | testPointCloud::MySyncPolicy |
Functions | |
| int | main (int argc, char **argv) |