#include <gtest/gtest.h>
#include <iostream>
#include <sensor_msgs/PointCloud2.h>
#include <pcl/io/pcd_io.h>
#include <pcl/features/feature.h>
#include <pcl/common/eigen.h>
#include <pcl/point_types.h>
#include <pcl/point_cloud.h>
#include <pcl/common/transforms.h>
Go to the source code of this file.
Functions | |
void | init () |
int | main (int argc, char **argv) |
TEST (PCL, DeMean) | |
TEST (PCL, Transform) | |
TEST (PCL, commonTransform) | |
Variables | |
PointCloud< PointXYZ > | cloud |
sensor_msgs::PointCloud2 | cloud_blob |
const float | PI = 3.14159265f |
const float | rho = sqrtf (2.0f) / 2.0f |
void init | ( | ) |
Definition at line 59 of file test_transforms.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 213 of file test_transforms.cpp.
TEST | ( | PCL | , |
DeMean | |||
) |
Definition at line 72 of file test_transforms.cpp.
TEST | ( | PCL | , |
Transform | |||
) |
Definition at line 146 of file test_transforms.cpp.
TEST | ( | PCL | , |
commonTransform | |||
) |
Definition at line 193 of file test_transforms.cpp.
Definition at line 55 of file test_transforms.cpp.
sensor_msgs::PointCloud2 cloud_blob |
Definition at line 56 of file test_transforms.cpp.
const float PI = 3.14159265f |
Definition at line 52 of file test_transforms.cpp.
const float rho = sqrtf (2.0f) / 2.0f |
Definition at line 53 of file test_transforms.cpp.