#include <ros/ros.h>#include <sensor_msgs/PointCloud2.h>#include <visualization_msgs/Marker.h>#include <pcl/point_types.h>#include <table_objects/GetObjects.h>
Go to the source code of this file.
| Functions | |
| void | callback (sensor_msgs::PointCloud2 cloud) | 
| int | main (int argc, char **argv) | 
| Variables | |
| ros::ServiceClient | client | 
| ros::Publisher | pub | 
| ros::Publisher | pub_marker | 
| void callback | ( | sensor_msgs::PointCloud2 | cloud | ) | 
Definition at line 53 of file test_table_objects.cpp.
| int main | ( | int | argc, | 
| char ** | argv | ||
| ) | 
Definition at line 92 of file test_table_objects.cpp.
Definition at line 49 of file test_table_objects.cpp.
Definition at line 50 of file test_table_objects.cpp.
Definition at line 51 of file test_table_objects.cpp.