#include <boost/thread.hpp>#include <ros/console.h>#include <ros/ros.h>#include <actionlib/server/simple_action_server.h>#include <image_cb_detector/image_cb_detector.h>#include <image_cb_detector/depth_to_pointcloud.h>#include <opencv2/core/core.hpp>#include <opencv2/core/core_c.h>#include <sensor_msgs/Image.h>#include <sensor_msgs/CameraInfo.h>#include <image_cb_detector/ConfigAction.h>#include <calibration_msgs/Interval.h>#include <message_filters/subscriber.h>#include <message_filters/synchronizer.h>#include <message_filters/sync_policies/approximate_time.h>#include <sensor_msgs/image_encodings.h>
Go to the source code of this file.
Classes | |
| class | RgbdCbDetectorAction |
Typedefs | |
| typedef message_filters::sync_policies::ApproximateTime < sensor_msgs::Image, sensor_msgs::Image, sensor_msgs::CameraInfo > | CameraSyncPolicy |
Functions | |
| int | main (int argc, char **argv) |
| typedef message_filters::sync_policies::ApproximateTime<sensor_msgs::Image, sensor_msgs::Image, sensor_msgs::CameraInfo> CameraSyncPolicy |
Definition at line 57 of file rgbd_cb_detector_action.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 272 of file rgbd_cb_detector_action.cpp.