test_io.cpp File Reference
#include <gtest/gtest.h>
#include <sensor_msgs/PointCloud2.h>
#include "pcl/ros/point_traits.h"
#include "pcl/point_types.h"
#include "pcl/io/io.h"
#include "pcl/io/pcd_io.h"
Go to the source code of this file.
Classes |
struct | PointXYZFPFH33 |
Functions |
int | main (int argc, char **argv) |
std::ostream & | operator<< (std::ostream &os, const PointXYZFPFH33 &p) |
| POINT_CLOUD_REGISTER_POINT_STRUCT (PointXYZFPFH33,(float, x, x)(float, y, y)(float, z, z)(float[33], histogram, fpfh)) |
| TEST (PCL, EigenConversions) |
| TEST (PCL, ExtendedIO) |
| TEST (PCL, PCDReaderWriter) |
| TEST (PCL, IO) |
| TEST (PCL, ConcatenateFields) |
| TEST (PCL, ConcatenatePoints) |
Function Documentation
int main |
( |
int |
argc, |
|
|
char ** |
argv | |
|
) |
| | |
std::ostream& operator<< |
( |
std::ostream & |
os, |
|
|
const PointXYZFPFH33 & |
p | |
|
) |
| | [inline] |
POINT_CLOUD_REGISTER_POINT_STRUCT |
( |
PointXYZFPFH33 |
, |
|
|
(float, x, x)(float, y, y)(float, z, z)(float[33], histogram, fpfh) |
| |
|
) |
| | |
TEST |
( |
PCL |
, |
|
|
EigenConversions |
| |
|
) |
| | |
TEST |
( |
PCL |
, |
|
|
ExtendedIO |
| |
|
) |
| | |
TEST |
( |
PCL |
, |
|
|
PCDReaderWriter |
| |
|
) |
| | |
TEST |
( |
PCL |
, |
|
|
ConcatenateFields |
| |
|
) |
| | |
TEST |
( |
PCL |
, |
|
|
ConcatenatePoints |
| |
|
) |
| | |