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