#include "openni2_camera/openni2_device_manager.h"
#include "openni2_camera/openni2_device.h"
#include <boost/date_time/posix_time/posix_time.hpp>
#include <boost/thread/thread.hpp>
#include <boost/foreach.hpp>
#include <iostream>
Go to the source code of this file.
Functions | |
void | ColorCallback (sensor_msgs::ImagePtr image) |
void | DepthCallback (sensor_msgs::ImagePtr image) |
void | IRCallback (sensor_msgs::ImagePtr image) |
int | main () |
Variables | |
int | color_counter_ = 0 |
int | depth_counter_ = 0 |
int | ir_counter_ = 0 |
void ColorCallback | ( | sensor_msgs::ImagePtr | image | ) |
Definition at line 53 of file test_wrapper.cpp.
void DepthCallback | ( | sensor_msgs::ImagePtr | image | ) |
Definition at line 58 of file test_wrapper.cpp.
void IRCallback | ( | sensor_msgs::ImagePtr | image | ) |
Definition at line 48 of file test_wrapper.cpp.
int main | ( | ) |
Definition at line 63 of file test_wrapper.cpp.
int color_counter_ = 0 |
Definition at line 45 of file test_wrapper.cpp.
int depth_counter_ = 0 |
Definition at line 46 of file test_wrapper.cpp.
int ir_counter_ = 0 |
Definition at line 44 of file test_wrapper.cpp.