#include <signal.h>
#include <stdlib.h>
#include <math.h>
#include <ctype.h>
#include <time.h>
#include "opencv/cv.h"
#include "opencv/cvaux.h"
#include "opencv/highgui.h"
#include "opencv/cxcore.h"
#include "ros/node_handle.h"
#include "std_msgs/UInt8.h"
#include "limits.h"
#include <iostream>
Go to the source code of this file.
Classes | |
class | LightProjector |
Defines | |
#define | BLOCK_SIZE 2 |
#define | HT 1024 |
#define | MAX_BLOCK_SIZE 128 |
#define | MIN_BLOCK_SIZE 1 |
#define | WD 1280 |
Functions | |
int | main (int argc, char **argv) |
int | min (int a, int b) |
Variables | |
IplImage * | BlankImage |
bool | BlankScreen = true |
bool | BlankScreenPrevious = false |
IplImage * | current |
IplImage * | Rbp |
std_msgs::UInt8 | status_out |
#define BLOCK_SIZE 2 |
Definition at line 57 of file project_light.cpp.
#define HT 1024 |
Definition at line 56 of file project_light.cpp.
#define MAX_BLOCK_SIZE 128 |
Definition at line 58 of file project_light.cpp.
#define MIN_BLOCK_SIZE 1 |
Definition at line 59 of file project_light.cpp.
#define WD 1280 |
Definition at line 55 of file project_light.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 250 of file project_light.cpp.
int min | ( | int | a, |
int | b | ||
) | [inline] |
Definition at line 62 of file project_light.cpp.
IplImage* BlankImage |
Definition at line 70 of file project_light.cpp.
bool BlankScreen = true |
Definition at line 67 of file project_light.cpp.
bool BlankScreenPrevious = false |
Definition at line 68 of file project_light.cpp.
IplImage* current |
Definition at line 71 of file project_light.cpp.
IplImage* Rbp |
Definition at line 69 of file project_light.cpp.
std_msgs::UInt8 status_out |
Definition at line 73 of file project_light.cpp.