#include <strstream>#include "ros/ros.h"#include <pcl/filters/voxel_grid.h>#include <pcl/filters/filter.h>#include "src/icp.h"#include "src/net_transfor.h"#include "boost/thread.hpp"#include <queue>
Go to the source code of this file.
Typedefs | |
| typedef boost::unordered_map < unordered_map_voxel, un_key > | umap |
Functions | |
| void | get_data () |
| int | main (int argc, char **argv) |
| void | pointCloud2Callback (const sensor_msgs::PointCloud2::ConstPtr &msg) |
Variables | |
| boost::mutex | io_mutex |
| std::queue< pcl::PointCloud < pcl::PointXYZ > > | point_queue |
| pcl::PCDWriter | writer |
| typedef boost::unordered_map<unordered_map_voxel,un_key> umap |
Definition at line 20 of file dlut_align.cpp.
| void get_data | ( | ) |
Definition at line 43 of file dlut_align.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 115 of file dlut_align.cpp.
| void pointCloud2Callback | ( | const sensor_msgs::PointCloud2::ConstPtr & | msg | ) |
Definition at line 24 of file dlut_align.cpp.
| boost::mutex io_mutex |
Definition at line 19 of file dlut_align.cpp.
| std::queue<pcl::PointCloud<pcl::PointXYZ> > point_queue |
Definition at line 21 of file dlut_align.cpp.
| pcl::PCDWriter writer |
Definition at line 22 of file dlut_align.cpp.