Classes | Typedefs | Functions | Variables
IZ Namespace Reference

Classes

class  BitCoderBase
 
class  BitDecoder
 
class  BitEncoder
 
class  Image
 
class  ImageDecoder
 
class  ImageEncoder
 
class  InputFile
 
class  OutputFile
 
class  Pixel
 
class  PortableImage
 
class  Predictor0
 
class  Predictor1x
 
class  Predictor1y
 
class  Predictor2avg
 
class  Predictor3alpha
 
class  Predictor3avgplane
 
class  Predictor3med
 
class  Predictor3plane
 

Typedefs

typedef unsigned int U32
 
typedef unsigned long long U64
 

Functions

static unsigned int absValue (int v)
 
static unsigned int bitMask (unsigned int bitCount)
 
static unsigned int bsr (unsigned int w)
 
static int cancelValue (int v, int v0)
 
static int clamp0 (int v)
 
static int clampByte (int v)
 
static int clampMax (int v, int max)
 
static int clampMin (int v, int min)
 
static int comp_int (const void *p1, const void *p2)
 
sensor_msgs::CompressedImage compressImage (const sensor_msgs::Image &image)
 
const unsigned char * decodeImage (Image<> &im, const unsigned char *src)
 
void decodeImageSize (Image<> &im, const unsigned char *src)
 
sensor_msgs::Image decompressImage (const sensor_msgs::CompressedImageConstPtr &compressed)
 
unsigned char * encodeImage (const Image<> &im, unsigned char *dest)
 
static void initBitsTable ()
 
void initDecodeTable ()
 
void initEncodeTable ()
 
static unsigned int numBits (unsigned int v)
 
static int oppositeSign (int v1, int v2)
 
static const unsigned char * readValue (const unsigned char *p, int &value)
 
static unsigned int s2u (int s)
 
static int selectVal (int s, int v0, int v1)
 
static unsigned int signBit (int v)
 
static int u2s (unsigned int u)
 
static unsigned char * writeValue (unsigned char *p, unsigned char whiteSpace, int value)
 

Variables

const int CONTEXT_BITS
 
const int CONTEXT_COUNT
 
const int CONTEXT_SIZE_REGULAR
 
const int CONTEXT_SIZE_RLE
 
static bool decode_tables_initialized = false
 
char decodeTable [1<< CONTEXT_BITS][MAX_CODE_VALUE]
 
static bool encode_tables_initialized = false
 
const int MAX_CODE_LENGTH
 
const int MAX_CODE_VALUE
 
unsigned int staticdBits [1<< (2 *CONTEXT_BITS)]
 
const unsigned int staticdCount [1<< (2 *CONTEXT_BITS)]
 

Function Documentation

sensor_msgs::CompressedImage IZ::compressImage ( const sensor_msgs::Image &  image)

Uses the ImageZero algorithm to compress a raw Image into a CompressedImage. The raw image must have 3 channels and either 8 or 16 bits per channel.

Parameters
[in]imageAn uncompressed 24-bit color image.
Returns
A compressed image based on that image.

Definition at line 55 of file ros_support.cpp.

sensor_msgs::Image IZ::decompressImage ( const sensor_msgs::CompressedImageConstPtr &  compressed)

Decompresses an image that had previous been compressed using ImageZero and returns a raw image.

Parameters
[in]compressedAn image that was compressed with ImageZero.
Returns
A raw image.

Definition at line 163 of file ros_support.cpp.

Variable Documentation

bool IZ::decode_tables_initialized = false
static

Definition at line 42 of file ros_support.h.

bool IZ::encode_tables_initialized = false
static

Definition at line 41 of file ros_support.h.



imagezero_ros
Author(s): P. J. Reed
autogenerated on Mon Jun 10 2019 13:37:24