#include <imagezero/portableimage.h>
#include <imagezero/libiz.h>
#include <sensor_msgs/Image.h>
#include <sensor_msgs/CompressedImage.h>
Go to the source code of this file.
Namespaces | |
IZ | |
Macros | |
#define | IMAGEZERO_ROS_ROS_SUPPORT_H |
Functions | |
sensor_msgs::CompressedImage | IZ::compressImage (const sensor_msgs::Image &image) |
sensor_msgs::Image | IZ::decompressImage (const sensor_msgs::CompressedImageConstPtr &compressed) |
Variables | |
static bool | IZ::decode_tables_initialized = false |
static bool | IZ::encode_tables_initialized = false |
#define IMAGEZERO_ROS_ROS_SUPPORT_H |
Definition at line 61 of file ros_support.h.