#include "polled_camera/publication_server.h"#include <ros/ros.h>#include <sensor_msgs/Image.h>#include <sensor_msgs/CameraInfo.h>#include "polled_camera/GetPolledImage.h"#include <boost/noncopyable.hpp>#include <boost/function.hpp>#include <stdexcept>#include "image_transport/exception.h"#include "image_transport/loader_fwds.h"#include "image_transport/single_subscriber_publisher.h"#include "image_transport/transport_hints.h"

Go to the source code of this file.
Namespaces | |
| namespace | polled_camera |
Functions | |
| PublicationServer | polled_camera::advertise (ros::NodeHandle &nh, const std::string &service, const PublicationServer::DriverCallback &cb, const ros::VoidPtr &tracked_object=ros::VoidPtr()) |
| Advertise a polled image service, version for arbitrary boost::function object. | |