#include <ros/ros.h>
#include <sensor_msgs/PointCloud2.h>
#include <pcl/point_types.h>
#include <pcl/filters/voxel_grid.h>
#include <pcl/filters/project_inliers.h>
#include <pcl/features/normal_3d.h>
#include <pcl/kdtree/kdtree_ann.h>
#include <pcl/segmentation/sac_segmentation.h>
#include <pcl/PointIndices.h>
#include <pcl/ModelCoefficients.h>
#include <table_pose/GetPose.h>
Go to the source code of this file.
Functions | |
bool | getTablePose (table_pose::GetPose::Request &req, table_pose::GetPose::Response &res) |
int | main (int argc, char **argv) |
Variables | |
ros::Publisher | pub |
bool getTablePose | ( | table_pose::GetPose::Request & | req, |
table_pose::GetPose::Response & | res | ||
) |
Definition at line 62 of file table_pose.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 124 of file table_pose.cpp.
Definition at line 59 of file table_pose.cpp.