$search

normals_vfh_db_estimator_service.cpp File Reference

#include "ros/ros.h"
#include <ros/message_traits.h>
#include <ros/serialization.h>
#include "sensor_msgs/PointCloud2.h"
#include "geometry_msgs/Pose.h"
#include "vfh_recognizer_fs/normals_vfh_db_estimator.h"
#include <pcl/common/common.h>
#include <fstream>
#include <iostream>
#include <pcl_ros/point_cloud.h>
#include <vfh_recognizer_fs/vfh_recognition.h>
#include <pcl/io/pcd_io.h>
#include <boost/filesystem.hpp>
#include <boost/random.hpp>
#include <boost/random/normal_distribution.hpp>
#include <Eigen/StdVector>
Include dependency graph for normals_vfh_db_estimator_service.cpp:

Go to the source code of this file.

Functions

bool compute_and_store (vfh_recognizer_fs::normals_vfh_db_estimator::Request &req, vfh_recognizer_fs::normals_vfh_db_estimator::Response &res)
bool create_directories_fs (std::string root)
int main (int argc, char **argv)
bool writeCentroidToFile (std::string file, Eigen::Vector3f centroid)
bool writePoseToFile (std::string file, geometry_msgs::Pose pose)
bool writeVFHViewMapToFile (std::string file, int view_id)
bool writeViewVFHMapToFile (std::string file, std::vector< int > map)

Variables

bool FILL_SIZE_COMPONENT_ = true
bool NORMALIZE_VFH_BINS_ = false
bool USE_CLUSTER_CENTROIDS_ = true
bool USE_OLD_VFH_ = false
int VFH_id_ = 0
vfh_recognizer_fs::VFHRecognizerFS
< flann::ChiSquareDistance > 
vfh_recognizer
int VIEW_id_ = 0

Function Documentation

Definition at line 163 of file normals_vfh_db_estimator_service.cpp.

bool create_directories_fs ( std::string  root  ) 

Definition at line 35 of file normals_vfh_db_estimator_service.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 354 of file normals_vfh_db_estimator_service.cpp.

bool writeCentroidToFile ( std::string  file,
Eigen::Vector3f  centroid 
)

Definition at line 144 of file normals_vfh_db_estimator_service.cpp.

bool writePoseToFile ( std::string  file,
geometry_msgs::Pose  pose 
)

Definition at line 90 of file normals_vfh_db_estimator_service.cpp.

bool writeVFHViewMapToFile ( std::string  file,
int  view_id 
)

Definition at line 128 of file normals_vfh_db_estimator_service.cpp.

bool writeViewVFHMapToFile ( std::string  file,
std::vector< int >  map 
)

Definition at line 107 of file normals_vfh_db_estimator_service.cpp.


Variable Documentation

bool FILL_SIZE_COMPONENT_ = true

Definition at line 31 of file normals_vfh_db_estimator_service.cpp.

bool NORMALIZE_VFH_BINS_ = false

Definition at line 30 of file normals_vfh_db_estimator_service.cpp.

Definition at line 29 of file normals_vfh_db_estimator_service.cpp.

bool USE_OLD_VFH_ = false

Definition at line 32 of file normals_vfh_db_estimator_service.cpp.

int VFH_id_ = 0

Definition at line 159 of file normals_vfh_db_estimator_service.cpp.

Definition at line 25 of file normals_vfh_db_estimator_service.cpp.

int VIEW_id_ = 0

Definition at line 160 of file normals_vfh_db_estimator_service.cpp.

 All Classes Namespaces Files Functions Variables Typedefs Enumerations Properties Friends


vfh_recognizer_fs
Author(s): Aitor Aldoma
autogenerated on Tue Mar 5 15:52:29 2013