#include <gtest/gtest.h>
#include <pcl/io/pcd_io.h>
#include <pcl/point_types.h>
#include <pcl/visualization/pcl_visualizer.h>
#include <pcl/sample_consensus/sac_model_plane.h>
#include <pcl/people/ground_based_people_detection_app.h>
Go to the source code of this file.
Typedefs | |
typedef pcl::PointCloud< PointT > | PointCloudT |
typedef pcl::PointXYZRGB | PointT |
Enumerations | |
enum | { COLS = 640, ROWS = 480 } |
Functions | |
int | main (int argc, char **argv) |
TEST (PCL, PersonClassifier) | |
TEST (PCL, GroundBasedPeopleDetectionApp) | |
Variables | |
PointCloudT::Ptr | cloud |
Eigen::VectorXf | ground_coeffs |
float | max_height |
float | min_confidence |
float | min_height |
pcl::people::PersonClassifier < pcl::RGB > | person_classifier |
Eigen::Matrix3f | rgb_intrinsics_matrix |
std::string | svm_filename |
float | voxel_size |
typedef pcl::PointCloud<PointT> PointCloudT |
Definition at line 56 of file test_people_groundBasedPeopleDetectionApp.cpp.
typedef pcl::PointXYZRGB PointT |
Definition at line 55 of file test_people_groundBasedPeopleDetectionApp.cpp.
anonymous enum |
Definition at line 58 of file test_people_groundBasedPeopleDetectionApp.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 99 of file test_people_groundBasedPeopleDetectionApp.cpp.
TEST | ( | PCL | , |
PersonClassifier | |||
) |
Definition at line 69 of file test_people_groundBasedPeopleDetectionApp.cpp.
TEST | ( | PCL | , |
GroundBasedPeopleDetectionApp | |||
) |
Definition at line 75 of file test_people_groundBasedPeopleDetectionApp.cpp.
Definition at line 59 of file test_people_groundBasedPeopleDetectionApp.cpp.
Eigen::VectorXf ground_coeffs |
Definition at line 67 of file test_people_groundBasedPeopleDetectionApp.cpp.
float max_height |
Definition at line 64 of file test_people_groundBasedPeopleDetectionApp.cpp.
float min_confidence |
Definition at line 62 of file test_people_groundBasedPeopleDetectionApp.cpp.
float min_height |
Definition at line 63 of file test_people_groundBasedPeopleDetectionApp.cpp.
Definition at line 60 of file test_people_groundBasedPeopleDetectionApp.cpp.
Eigen::Matrix3f rgb_intrinsics_matrix |
Definition at line 66 of file test_people_groundBasedPeopleDetectionApp.cpp.
Definition at line 61 of file test_people_groundBasedPeopleDetectionApp.cpp.
float voxel_size |
Definition at line 65 of file test_people_groundBasedPeopleDetectionApp.cpp.