#include <boost/shared_ptr.hpp>#include <boost/cstdint.hpp>#include <boost/bind.hpp>#include <boost/function.hpp>#include <boost/thread/mutex.hpp>#include <sensor_msgs/Image.h>#include <image_transport/image_transport.h>#include "ImiNect.h"#include "ImiCamera.h"#include <sensor_msgs/PointCloud2.h>#include <string>#include <vector>

Go to the source code of this file.
| Classes | |
| class | imi_wrapper::ImiDevice | 
| Namespaces | |
| imi_wrapper | |
| Macros | |
| #define | IMI_DEVICE_H | 
| Typedefs | |
| typedef boost::function< void(boost::shared_ptr< sensor_msgs::PointCloud2 > cloudPtr)> | imi_wrapper::CloudCallbackFunction | 
| typedef boost::function< void(sensor_msgs::ImagePtr image)> | imi_wrapper::FrameCallbackFunction | 
| #define IMI_DEVICE_H | 
Definition at line 4 of file imi_Device.h.