#include <gtest/gtest.h>#include <iostream>#include <sensor_msgs/PointCloud2.h>#include "pcl/io/pcd_io.h"#include "pcl/features/feature.h"#include <pcl/point_types.h>#include <pcl/point_cloud.h>#include <pcl/registration/transforms.h>
Go to the source code of this file.
Classes | |
| class | MyPointXYZ |
Functions | |
| void | init () |
| int | main (int argc, char **argv) |
| TEST (PCL, Transform) | |
| TEST (PCL, DeMean) | |
Variables | |
| PointCloud< PointXYZ > | cloud |
| const float | PI = 3.14159265 |
| const float | rho = sqrt (2) / 2 |
| void init | ( | ) |
Definition at line 70 of file test_transforms.cpp.
| int main | ( | int | argc, | |
| char ** | argv | |||
| ) |
Definition at line 208 of file test_transforms.cpp.
| TEST | ( | PCL | , | |
| Transform | ||||
| ) |
Definition at line 159 of file test_transforms.cpp.
| TEST | ( | PCL | , | |
| DeMean | ||||
| ) |
Definition at line 83 of file test_transforms.cpp.
Definition at line 67 of file test_transforms.cpp.
| const float PI = 3.14159265 |
Definition at line 53 of file test_transforms.cpp.
| const float rho = sqrt (2) / 2 |
Definition at line 54 of file test_transforms.cpp.