34 #ifndef RC_DEPTHPUBLISHER_H 35 #define RC_DEPTHPUBLISHER_H 40 #include <sensor_msgs/Image.h> Interface for all publishers relating to images, point clouds or other stereo-camera data...
DepthPublisher & operator=(const DepthPublisher &)
bool used() override
Returns true if there are subscribers to the topic.
void publish(const rcg::Buffer *buffer, uint32_t part, uint64_t pixelformat) override
Offers a buffer for publication.
DepthPublisher(ros::NodeHandle &nh, const std::string &frame_id_prefix, double f, double t, double scale)
Initialization of publisher.