$search
#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_db/normals_vfh_db_estimator.h"#include <pcl/common/common.h>#include "household_objects_database/database_view.h"#include "household_objects_database/database_vfh.h"#include "household_objects_database/database_vfh_orientation.h"#include "household_objects_database/objects_database.h"#include "household_objects_database/database_helper_classes.h"#include <fstream>#include <iostream>#include <pcl_ros/point_cloud.h>#include <vfh_recognizer_db/vfh_recognition.h>
Go to the source code of this file.
Typedefs | |
| typedef pcl::PointCloud < pcl::PointXYZ > | PointCloud |
Functions | |
| void | getPointCloudFromView (pcl::PointCloud< pcl::PointNormal > &cloud, boost::shared_ptr< household_objects_database::DatabaseView > &view) |
| int | main (int argc, char **argv) |
Variables | |
| household_objects_database::ObjectsDatabase * | database |
| typedef pcl::PointCloud<pcl::PointXYZ> PointCloud |
Definition at line 21 of file update_vfh_descriptors.cpp.
| void getPointCloudFromView | ( | pcl::PointCloud< pcl::PointNormal > & | cloud, | |
| boost::shared_ptr< household_objects_database::DatabaseView > & | view | |||
| ) |
Definition at line 25 of file update_vfh_descriptors.cpp.
| int main | ( | int | argc, | |
| char ** | argv | |||
| ) |
Definition at line 37 of file update_vfh_descriptors.cpp.
Definition at line 22 of file update_vfh_descriptors.cpp.