#include <ros/ros.h>#include <image_transport/image_transport.h>#include <sensor_msgs/Image.h>#include <rc_genicam_api/buffer.h>#include <string>

Go to the source code of this file.
Classes | |
| class | rcgccam::ImagePublisher |
Namespaces | |
| rcgccam | |
Functions | |
| sensor_msgs::ImagePtr | rcgccam::rosImageFromBuffer (const std::string &frame_id, const rcg::Buffer *buffer, uint32_t part, bool rotate) |
| Converts a (supported) image in a GenICam buffer into a ROS image. More... | |
| std::string | rcgccam::rosPixelformat (int &bytes_per_pixel, uint64_t pixelformat) |
| Translates pixel format from GenICam to ROS. More... | |