#include <ros/ros.h>
#include <actionlib/client/simple_action_client.h>
#include <sensor_msgs/Image.h>
#include <sensor_msgs/CameraInfo.h>
#include <sensor_msgs/PointCloud2.h>
#include <stereo_msgs/DisparityImage.h>
#include "object_segmentation_gui/ObjectSegmentationGuiAction.h"
#include <rgbd_assembler/RgbdAssembly.h>
Go to the source code of this file.
Functions | |
template<class ServiceType > | |
bool | connectService (ros::NodeHandle &nh, ros::ServiceClient &service_client, std::string topic) |
int | main (int argc, char **argv) |
bool connectService | ( | ros::NodeHandle & | nh, |
ros::ServiceClient & | service_client, | ||
std::string | topic | ||
) |
Definition at line 44 of file ping_object_segmentation_gui_rgbd_assembly.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 56 of file ping_object_segmentation_gui_rgbd_assembly.cpp.