$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/remove_duplicate_views.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>#include <pcl/registration/registration.h>#include <pcl/registration/icp.h>#include <pcl/segmentation/segment_differences.h>
Go to the source code of this file.
Functions | |
| void | getPointCloudFromView (pcl::PointCloud< pcl::PointNormal > &cloud, boost::shared_ptr< household_objects_database::DatabaseView > &view, household_objects_database::ObjectsDatabase &database) |
| bool | getUniqueViews (vfh_recognizer_db::remove_duplicate_views::Request &req, vfh_recognizer_db::remove_duplicate_views::Response &res) |
| void | getVFHFromView (boost::shared_ptr< household_objects_database::DatabaseView > &view, pcl::PointCloud< pcl::VFHSignature308 > &vfh_signature, household_objects_database::ObjectsDatabase &database) |
| int | main (int argc, char **argv) |
| void getPointCloudFromView | ( | pcl::PointCloud< pcl::PointNormal > & | cloud, | |
| boost::shared_ptr< household_objects_database::DatabaseView > & | view, | |||
| household_objects_database::ObjectsDatabase & | database | |||
| ) |
Definition at line 48 of file remove_duplicate_views_service.cpp.
| bool getUniqueViews | ( | vfh_recognizer_db::remove_duplicate_views::Request & | req, | |
| vfh_recognizer_db::remove_duplicate_views::Response & | res | |||
| ) |
Definition at line 60 of file remove_duplicate_views_service.cpp.
| void getVFHFromView | ( | boost::shared_ptr< household_objects_database::DatabaseView > & | view, | |
| pcl::PointCloud< pcl::VFHSignature308 > & | vfh_signature, | |||
| household_objects_database::ObjectsDatabase & | database | |||
| ) |
Definition at line 33 of file remove_duplicate_views_service.cpp.
| int main | ( | int | argc, | |
| char ** | argv | |||
| ) |
Definition at line 290 of file remove_duplicate_views_service.cpp.