#include <ndt_matcher_p2d.h>#include <ndt_matcher_d2d.h>#include <ndt_map.h>#include <oc_tree.h>#include <pointcloud_utils.h>#include "ros/ros.h"#include "pcl/point_cloud.h"#include "sensor_msgs/PointCloud2.h"#include "pcl/io/pcd_io.h"#include "pcl/features/feature.h"#include "pcl/registration/icp.h"#include "pcl/filters/voxel_grid.h"#include <pcl/filters/passthrough.h>#include <cstdio>#include <Eigen/Eigen>#include <Eigen/Geometry>#include <fstream>
Go to the source code of this file.
Functions | |
| int | main (int argc, char **argv) |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 95 of file ndt_registration_test.cc.