Public Member Functions | |
void | grayscale_rbp (IplImage *rbp, int offset=0, int range=128, int block_size=BLOCK_SIZE, bool ramp=false) |
LightProjector (ros::NodeHandle &n) | |
bool | spin () |
Public Attributes | |
int | _block_size |
int | _offset |
bool | _ramp |
int | _range |
int | alt2_on1_off0 |
float | ffactor |
Private Attributes | |
double | frequency |
ros::NodeHandle | n_ |
ros::Publisher | status_publisher |
Definition at line 77 of file project_light.cpp.
LightProjector::LightProjector | ( | ros::NodeHandle & | n | ) | [inline] |
Definition at line 85 of file project_light.cpp.
void LightProjector::grayscale_rbp | ( | IplImage * | rbp, |
int | offset = 0 , |
||
int | range = 128 , |
||
int | block_size = BLOCK_SIZE , |
||
bool | ramp = false |
||
) | [inline] |
Definition at line 98 of file project_light.cpp.
bool LightProjector::spin | ( | ) | [inline] |
Definition at line 132 of file project_light.cpp.
Definition at line 81 of file project_light.cpp.
Definition at line 81 of file project_light.cpp.
Definition at line 82 of file project_light.cpp.
Definition at line 81 of file project_light.cpp.
Definition at line 80 of file project_light.cpp.
float LightProjector::ffactor |
Definition at line 83 of file project_light.cpp.
double LightProjector::frequency [private] |
Definition at line 245 of file project_light.cpp.
ros::NodeHandle LightProjector::n_ [private] |
Definition at line 247 of file project_light.cpp.
Definition at line 246 of file project_light.cpp.