Description: More...
#include <cstdlib>
#include <cob_3d_mapping_common/label_defines.h>
#include <cob_3d_evaluation_features/label_results.h>
#include <boost/program_options.hpp>
#include <fstream>
#include <math.h>
#include <pcl/io/pcd_io.h>
#include <pcl/point_types.h>
#include <pcl/filters/voxel_grid.h>
#include <pcl/filters/passthrough.h>
#include <pcl/kdtree/kdtree_flann.h>
#include <pcl/surface/mls.h>
#include <pcl/features/normal_3d.h>
#include <pcl/features/principal_curvatures.h>
#include <pcl/features/rsd.h>
#include <pcl/features/fpfh.h>
#include <pcl/visualization/pcl_visualizer.h>
#include <pcl/visualization/point_cloud_handlers.h>
#include <opencv2/ml/ml.hpp>
#include <opencv2/highgui/highgui.hpp>
Go to the source code of this file.
Typedefs | |
typedef visualization::PointCloudColorHandlerRGBField < PointXYZRGB > | ColorHdlRGB |
Functions | |
string | fl2label (const float &f, const size_t &precision=3) |
int | main (int argc, char **argv) |
void | processFPFH (const PointCloud< PointXYZRGB >::Ptr in, PointCloud< PointXYZRGB >::Ptr ref_out, PointCloud< PointXYZRGB >::Ptr fpfh_out) |
runs the whole processing pipeline for FPFH features | |
void | processPC (const PointCloud< PointXYZRGB >::Ptr in, PointCloud< PointXYZRGB >::Ptr ref_out, PointCloud< PointXYZRGB >::Ptr pc_out) |
void | processRSD (const PointCloud< PointXYZRGB >::Ptr in, PointCloud< PointXYZRGB >::Ptr ref_out, PointCloud< PointXYZRGB >::Ptr rsd_out) |
void | readOptions (int argc, char *argv[]) |
Variables | |
float | c_high |
float | c_low |
float | c_r1 |
float | c_r2 |
string | camera_pos_ |
string | file_in_ |
bool | fpfh_enable_ |
bool | fpfh_mls_enable_ |
float | fpfh_rf_ |
float | fpfh_rn_ |
string | fpfh_svm_model_ |
float | fpfh_vox_ |
bool | fpfh_vox_enable_ |
float | pass_depth_ |
bool | pc_enable_ |
bool | pc_mls_enable_ |
float | pc_rf_ |
float | pc_rn_ |
float | pc_vox_ |
bool | pc_vox_enable_ |
bool | quiet_ |
float | r_high |
float | r_limit_ |
float | r_low |
float | r_r1 |
float | r_r2 |
bool | rsd_enable_ |
bool | rsd_mls_enable_ |
float | rsd_rf_ |
float | rsd_rn_ |
float | rsd_vox_ |
bool | rsd_vox_enable_ |
Description:
ToDo:
Redistribution and use in source and binary forms, with or without modification, are permitted provided that the following conditions are met:
This program is free software: you can redistribute it and/or modify it under the terms of the GNU Lesser General Public License LGPL as published by the Free Software Foundation, either version 3 of the License, or (at your option) any later version.
This program is distributed in the hope that it will be useful, but WITHOUT ANY WARRANTY; without even the implied warranty of MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE. See the GNU Lesser General Public License LGPL for more details.
You should have received a copy of the GNU Lesser General Public License LGPL along with this program. If not, see <http://www.gnu.org/licenses/>.
Definition in file evaluation_features.cpp.
typedef visualization::PointCloudColorHandlerRGBField<PointXYZRGB> ColorHdlRGB |
Definition at line 93 of file evaluation_features.cpp.
string fl2label | ( | const float & | f, |
const size_t & | precision = 3 |
||
) |
Definition at line 135 of file evaluation_features.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 790 of file evaluation_features.cpp.
void processFPFH | ( | const PointCloud< PointXYZRGB >::Ptr | in, |
PointCloud< PointXYZRGB >::Ptr | ref_out, | ||
PointCloud< PointXYZRGB >::Ptr | fpfh_out | ||
) |
runs the whole processing pipeline for FPFH features
[in] | in | the labeled input point cloud |
[out] | ref_out | the reference point cloud after the preprocessing steps |
[out] | fpfh_out | the labeled point cloud after the classifing process |
Definition at line 236 of file evaluation_features.cpp.
void processPC | ( | const PointCloud< PointXYZRGB >::Ptr | in, |
PointCloud< PointXYZRGB >::Ptr | ref_out, | ||
PointCloud< PointXYZRGB >::Ptr | pc_out | ||
) |
Definition at line 418 of file evaluation_features.cpp.
void processRSD | ( | const PointCloud< PointXYZRGB >::Ptr | in, |
PointCloud< PointXYZRGB >::Ptr | ref_out, | ||
PointCloud< PointXYZRGB >::Ptr | rsd_out | ||
) |
Definition at line 605 of file evaluation_features.cpp.
void readOptions | ( | int | argc, |
char * | argv[] | ||
) |
Definition at line 149 of file evaluation_features.cpp.
float c_high |
Definition at line 119 of file evaluation_features.cpp.
float c_low |
Definition at line 118 of file evaluation_features.cpp.
float c_r1 |
Definition at line 120 of file evaluation_features.cpp.
float c_r2 |
Definition at line 121 of file evaluation_features.cpp.
string camera_pos_ |
Definition at line 132 of file evaluation_features.cpp.
string file_in_ |
Definition at line 130 of file evaluation_features.cpp.
bool fpfh_enable_ |
Definition at line 123 of file evaluation_features.cpp.
bool fpfh_mls_enable_ |
Definition at line 124 of file evaluation_features.cpp.
float fpfh_rf_ |
Definition at line 128 of file evaluation_features.cpp.
float fpfh_rn_ |
Definition at line 127 of file evaluation_features.cpp.
string fpfh_svm_model_ |
Definition at line 131 of file evaluation_features.cpp.
float fpfh_vox_ |
Definition at line 126 of file evaluation_features.cpp.
bool fpfh_vox_enable_ |
Definition at line 125 of file evaluation_features.cpp.
float pass_depth_ |
Definition at line 96 of file evaluation_features.cpp.
bool pc_enable_ |
Definition at line 111 of file evaluation_features.cpp.
bool pc_mls_enable_ |
Definition at line 112 of file evaluation_features.cpp.
float pc_rf_ |
Definition at line 116 of file evaluation_features.cpp.
float pc_rn_ |
Definition at line 115 of file evaluation_features.cpp.
float pc_vox_ |
Definition at line 114 of file evaluation_features.cpp.
bool pc_vox_enable_ |
Definition at line 113 of file evaluation_features.cpp.
bool quiet_ |
Definition at line 133 of file evaluation_features.cpp.
float r_high |
Definition at line 107 of file evaluation_features.cpp.
float r_limit_ |
Definition at line 105 of file evaluation_features.cpp.
float r_low |
Definition at line 106 of file evaluation_features.cpp.
float r_r1 |
Definition at line 108 of file evaluation_features.cpp.
float r_r2 |
Definition at line 109 of file evaluation_features.cpp.
bool rsd_enable_ |
Definition at line 98 of file evaluation_features.cpp.
bool rsd_mls_enable_ |
Definition at line 99 of file evaluation_features.cpp.
float rsd_rf_ |
Definition at line 103 of file evaluation_features.cpp.
float rsd_rn_ |
Definition at line 102 of file evaluation_features.cpp.
float rsd_vox_ |
Definition at line 101 of file evaluation_features.cpp.
bool rsd_vox_enable_ |
Definition at line 100 of file evaluation_features.cpp.