#include <ros/ros.h>#include <rosbag/bag.h>#include <pcl/point_types.h>#include <pcl/point_cloud.h>#include <pcl/io/pcd_io.h>#include <cob_3d_mapping_slam/curved_polygons/form.h>#include <visualization_msgs/Marker.h>#include <cob_3d_mapping_slam/curved_polygons/debug_interface.h>#include <cob_3d_mapping_slam/dof/tflink.h>#include <cob_3d_mapping_slam/dof/dof_uncertainty.h>#include <cob_3d_mapping_slam/dof/dof_variance.h>#include <cob_3d_mapping_slam/curved_polygons/objctxt.h>#include <cob_3d_mapping_slam/slam/dummy/robot.h>#include "gnuplot_i.hpp"#include <gtest/gtest.h>#include <unsupported/Eigen/NonLinearOptimization>#include <cob_3d_mapping_slam/curved_polygons/surface_tri_spline.h>#include <cob_3d_mapping_slam/trispline/trispline.h>#include <omp.h>
Go to the source code of this file.
Classes | |
| struct | MyFunctor |
Defines | |
| #define | ATOM_TESTING_ |
| #define | DEBUG_ |
| #define | ENABLE_TEST_20 |
Functions | |
| void | ADD_POINT (Slam_CurvedPolygon::Outline &O, const float x, const float y, const float e) |
| void | Surface2PCD (const Slam_Surface::Surface *surf, pcl::PointCloud< pcl::PointXYZRGB > &pc, const float Fsize, const int r, const int g, const int b) |
| void | t1 () |
| void | test10 () |
| void | test11 () |
| void | test12 () |
| void | test14 () |
| void | test15 () |
| void | test16 () |
| void | test18 () |
| void | test19 () |
| void | test2 () |
| void | test3 () |
| void | test4 () |
| void | test5 () |
| void | test6 () |
| void | test7 () |
| void | test8 () |
| void | test9 () |
| #define ATOM_TESTING_ |
Definition at line 9 of file merging.cpp.
| #define DEBUG_ |
Definition at line 8 of file merging.cpp.
| #define ENABLE_TEST_20 |
Definition at line 54 of file merging.cpp.
| void ADD_POINT | ( | Slam_CurvedPolygon::Outline & | O, |
| const float | x, | ||
| const float | y, | ||
| const float | e | ||
| ) |
Definition at line 104 of file merging.cpp.
| void Surface2PCD | ( | const Slam_Surface::Surface * | surf, |
| pcl::PointCloud< pcl::PointXYZRGB > & | pc, | ||
| const float | Fsize, | ||
| const int | r, | ||
| const int | g, | ||
| const int | b | ||
| ) |
Definition at line 755 of file merging.cpp.
| void t1 | ( | ) |
Definition at line 89 of file merging.cpp.
| void test10 | ( | ) |
Definition at line 579 of file merging.cpp.
| void test11 | ( | ) |
Definition at line 612 of file merging.cpp.
| void test12 | ( | ) |
Definition at line 730 of file merging.cpp.
| void test14 | ( | ) |
Definition at line 275 of file merging.cpp.
| void test15 | ( | ) |
Definition at line 149 of file merging.cpp.
| void test16 | ( | ) |
Definition at line 173 of file merging.cpp.
| void test18 | ( | ) |
Definition at line 786 of file merging.cpp.
| void test19 | ( | ) |
Definition at line 945 of file merging.cpp.
| void test2 | ( | ) |
Definition at line 116 of file merging.cpp.
| void test3 | ( | ) |
Definition at line 340 of file merging.cpp.
| void test4 | ( | ) |
Definition at line 375 of file merging.cpp.
| void test5 | ( | ) |
Definition at line 401 of file merging.cpp.
| void test6 | ( | ) |
Definition at line 491 of file merging.cpp.
| void test7 | ( | ) |
Definition at line 510 of file merging.cpp.
| void test8 | ( | ) |
Definition at line 530 of file merging.cpp.
| void test9 | ( | ) |
Definition at line 558 of file merging.cpp.