#include <stdio.h>#include <stdlib.h>#include <string.h>#include <assert.h>#include <fcntl.h>#include <unistd.h>#include <errno.h>#include <malloc.h>#include <sys/stat.h>#include <sys/types.h>#include <sys/time.h>#include <sys/mman.h>#include <sys/ioctl.h>#include <ros/ros.h>#include <boost/lexical_cast.hpp>#include <sensor_msgs/fill_image.h>#include <usb_cam/usb_cam.h>
Go to the source code of this file.
Namespaces | |
| namespace | usb_cam |
Defines | |
| #define | __STDC_CONSTANT_MACROS |
| #define | CLEAR(x) memset (&(x), 0, sizeof (x)) |
Functions | |
| static unsigned char | usb_cam::CLIPVALUE (int val) |
| static void | usb_cam::errno_exit (const char *s) |
| static void | usb_cam::mono102mono8 (char *RAW, char *MONO, int NumPixels) |
| void | usb_cam::rgb242rgb (char *YUV, char *RGB, int NumPixels) |
| void | usb_cam::uyvy2rgb (char *YUV, char *RGB, int NumPixels) |
| static int | usb_cam::xioctl (int fd, int request, void *arg) |
| static void | usb_cam::YUV2RGB (const unsigned char y, const unsigned char u, const unsigned char v, unsigned char *r, unsigned char *g, unsigned char *b) |
| static void | usb_cam::yuyv2rgb (char *YUV, char *RGB, int NumPixels) |
Variables | |
| const int | usb_cam::clipping_table_offset = 128 |
| const unsigned char | usb_cam::uchar_clipping_table [] |
| #define __STDC_CONSTANT_MACROS |
Definition at line 36 of file usb_cam.cpp.
| #define CLEAR | ( | x | ) | memset (&(x), 0, sizeof (x)) |
Definition at line 57 of file usb_cam.cpp.