#include <ros/ros.h>
#include <sensor_msgs/PointCloud2.h>
#include <mapping_msgs/CollisionObject.h>
#include <pcl/point_types.h>
#include <pcl/common/eigen.h>
#include <pcl/features/feature.h>
#include <pcl/segmentation/extract_clusters.h>
#include <table_objects/GetObjects.h>
#include <table_objects/GetLastObjects.h>
#include <table_objects/table_objects.h>
#include <Eigen3/Core>
#include <Eigen3/Geometry>
Go to the source code of this file.
Functions | |
bool | getTableObjects (table_objects::GetObjects::Request &req, table_objects::GetObjects::Response &res) |
int | main (int argc, char **argv) |
Variables | |
bool | classify |
flann::Index< flann::L2< float > > * | flann_index |
bool getTableObjects | ( | table_objects::GetObjects::Request & | req, |
table_objects::GetObjects::Response & | res | ||
) |
Definition at line 80 of file table_objects.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 241 of file table_objects.cpp.
Definition at line 62 of file table_objects.cpp.
flann::Index< flann::L2<float> >* flann_index |
Definition at line 63 of file table_objects.cpp.