#include <gtest/gtest.h>#include <pcl/point_types.h>#include <pcl/io/pcd_io.h>#include <pcl/filters/filter.h>#include <pcl/filters/passthrough.h>#include <pcl/filters/voxel_grid.h>#include <pcl/filters/extract_indices.h>#include <pcl/filters/project_inliers.h>#include <pcl/filters/radius_outlier_removal.h>#include <pcl/filters/statistical_outlier_removal.h>#include <pcl/filters/conditional_removal.h>
Go to the source code of this file.
Functions | |
| int | main (int argc, char **argv) |
| TEST (ConditionalRemoval, Filters) | |
| TEST (StatisticalOutlierRemoval, Filters) | |
| TEST (RadiusOutlierRemoval, Filters) | |
| TEST (ProjectInliers, Filters) | |
| TEST (VoxelGrid_RGB, Filters) | |
| TEST (VoxelGrid, Filters) | |
| TEST (PassThrough, Filters) | |
| TEST (ExtractIndices, Filters) | |
Variables | |
| PointCloud< PointXYZ > | cloud_ |
| sensor_msgs::PointCloud2 | cloud_blob_ |
| sensor_msgs::PointCloud2::Ptr | cloud_blob_ptr_ |
| PointCloud< PointXYZ >::Ptr | cloud_ptr_ |
| vector< int > | indices_ |
| int main | ( | int | argc, | |
| char ** | argv | |||
| ) |
Definition at line 756 of file test_filters.cpp.
| TEST | ( | ConditionalRemoval | , | |
| Filters | ||||
| ) |
Definition at line 710 of file test_filters.cpp.
| TEST | ( | StatisticalOutlierRemoval | , | |
| Filters | ||||
| ) |
Definition at line 651 of file test_filters.cpp.
| TEST | ( | RadiusOutlierRemoval | , | |
| Filters | ||||
| ) |
Definition at line 615 of file test_filters.cpp.
| TEST | ( | ProjectInliers | , | |
| Filters | ||||
| ) |
Definition at line 578 of file test_filters.cpp.
| TEST | ( | VoxelGrid_RGB | , | |
| Filters | ||||
| ) |
Definition at line 496 of file test_filters.cpp.
| TEST | ( | VoxelGrid | , | |
| Filters | ||||
| ) |
Definition at line 336 of file test_filters.cpp.
| TEST | ( | PassThrough | , | |
| Filters | ||||
| ) |
Definition at line 142 of file test_filters.cpp.
| TEST | ( | ExtractIndices | , | |
| Filters | ||||
| ) |
Definition at line 62 of file test_filters.cpp.
Definition at line 57 of file test_filters.cpp.
Definition at line 55 of file test_filters.cpp.
Definition at line 56 of file test_filters.cpp.
| PointCloud<PointXYZ>::Ptr cloud_ptr_ |
Definition at line 58 of file test_filters.cpp.
| vector<int> indices_ |
Definition at line 59 of file test_filters.cpp.