#include <gtest/gtest.h>
#include <sensor_msgs/PointCloud2.h>
#include <pcl/point_traits.h>
#include <pcl/point_types.h>
#include <pcl/common/io.h>
#include <pcl/console/print.h>
#include <pcl/io/pcd_io.h>
#include <pcl/io/ply_io.h>
#include <fstream>
#include <locale>
#include <stdexcept>
Go to the source code of this file.
Classes | |
struct | PointXYZFPFH33 |
Functions | |
int | main (int argc, char **argv) |
POINT_CLOUD_REGISTER_POINT_STRUCT (PointXYZFPFH33,(float, x, x)(float, y, y)(float, z, z)(float[33], histogram, fpfh)) inline std | |
TEST (PCL, ComplexPCDFileASCII) | |
TEST (PCL, AllTypesPCDFile) | |
TEST (PCL, ConcatenatePoints) | |
TEST (PCL, ConcatenateFields) | |
TEST (PCL, IO) | |
TEST (PCL, PCDReaderWriter) | |
TEST (PCL, PCDReaderWriterEigen) | |
TEST (PCL, PLYReaderWriter) | |
TEST (PCL, ExtendedIO) | |
TEST (PCL, EigenConversions) | |
TEST (PCL, CopyPointCloud) | |
TEST (PCL, LZF) | |
TEST (PCL, LZFExtended) | |
TEST (PCL, Locale) |
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 1269 of file test_io.cpp.
POINT_CLOUD_REGISTER_POINT_STRUCT | ( | PointXYZFPFH33 | , |
(float, x, x)(float, y, y)(float, z, z)(float[33], histogram, fpfh) | |||
) |
Definition at line 948 of file test_io.cpp.
TEST | ( | PCL | , |
ComplexPCDFileASCII | |||
) |
Definition at line 56 of file test_io.cpp.
TEST | ( | PCL | , |
AllTypesPCDFile | |||
) |
Definition at line 160 of file test_io.cpp.
TEST | ( | PCL | , |
ConcatenatePoints | |||
) |
Definition at line 259 of file test_io.cpp.
TEST | ( | PCL | , |
ConcatenateFields | |||
) |
Definition at line 306 of file test_io.cpp.
TEST | ( | PCL | , |
IO | |||
) |
Definition at line 349 of file test_io.cpp.
TEST | ( | PCL | , |
PCDReaderWriter | |||
) |
Definition at line 656 of file test_io.cpp.
TEST | ( | PCL | , |
PCDReaderWriterEigen | |||
) |
Definition at line 724 of file test_io.cpp.
TEST | ( | PCL | , |
PLYReaderWriter | |||
) |
Definition at line 882 of file test_io.cpp.
TEST | ( | PCL | , |
ExtendedIO | |||
) |
Definition at line 961 of file test_io.cpp.
TEST | ( | PCL | , |
EigenConversions | |||
) |
Definition at line 994 of file test_io.cpp.
TEST | ( | PCL | , |
CopyPointCloud | |||
) |
Definition at line 1041 of file test_io.cpp.
TEST | ( | PCL | , |
LZF | |||
) |
Definition at line 1083 of file test_io.cpp.
TEST | ( | PCL | , |
LZFExtended | |||
) |
Definition at line 1140 of file test_io.cpp.
TEST | ( | PCL | , |
Locale | |||
) |
Definition at line 1190 of file test_io.cpp.