#include <NDTMatcher.hh>#include <NDTMatcherF2F.hh>#include <NDTMap.hh>#include <OctTree.hh>#include <AdaptiveOctTree.hh>#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 <cstdio>#include <Eigen/Eigen>#include <PointCloudUtils.hh>#include <fstream>
Go to the source code of this file.
Defines | |
| #define | DEBUG_COVARIANCE 0 |
Functions | |
| float | box_muller (float m, float s) |
| int | main (int argc, char **argv) |
| bool | matchICP (pcl::PointCloud< pcl::PointXYZ > &fixed, pcl::PointCloud< pcl::PointXYZ > &moving, Eigen::Transform< double, 3, Eigen::Affine, Eigen::ColMajor > &Tout) |
| float | ranf () |
| #define DEBUG_COVARIANCE 0 |
Definition at line 19 of file test_covariance.cc.
| float box_muller | ( | float | m, |
| float | s | ||
| ) |
Definition at line 28 of file test_covariance.cc.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 124 of file test_covariance.cc.
| bool matchICP | ( | pcl::PointCloud< pcl::PointXYZ > & | fixed, |
| pcl::PointCloud< pcl::PointXYZ > & | moving, | ||
| Eigen::Transform< double, 3, Eigen::Affine, Eigen::ColMajor > & | Tout | ||
| ) |
Definition at line 60 of file test_covariance.cc.
| float ranf | ( | ) |
Definition at line 23 of file test_covariance.cc.