Go to the documentation of this file.
33 #ifndef ASTRA_DEVICE_H
34 #define ASTRA_DEVICE_H
43 #include <boost/shared_ptr.hpp>
44 #include <boost/cstdint.hpp>
45 #include <boost/bind.hpp>
46 #include <boost/function.hpp>
48 #include <sensor_msgs/Image.h>
74 const std::string
getUri()
const;
76 const std::string
getName()
const;
void setIRVideoMode(const AstraVideoMode &video_mode)
void setLaser(bool enable)
int getIRExposure() const
const std::string getStringID() const
boost::shared_ptr< AstraFrameListener > depth_frame_listener
bool hasDepthSensor() const
float getBaseline() const
std::ostream & operator<<(std::ostream &stream, const AstraDevice &device)
void setCameraParams(OBCameraParams param)
boost::shared_ptr< AstraFrameListener > color_frame_listener
boost::shared_ptr< AstraFrameListener > ir_frame_listener
void setAutoExposure(bool enable)
void callback(const sensor_msgs::ImageConstPtr &msg)
bool isIRVideoModeSupported(const AstraVideoMode &video_mode) const
bool isDepthVideoModeSupported(const AstraVideoMode &video_mode) const
boost::shared_ptr< openni::VideoStream > getDepthVideoStream() const
bool isDepthStreamStarted()
const std::vector< AstraVideoMode > & getSupportedIRVideoModes() const
void setUseDeviceTimer(bool enable)
boost::shared_ptr< openni::VideoStream > depth_video_stream_
OBCameraParams getCameraParams() const
void setIRFrameCallback(FrameCallbackFunction callback)
uint16_t getUsbProductId() const
std::vector< AstraVideoMode > ir_video_modes_
uint16_t getUsbVendorId() const
float getColorFocalLength(int output_y_resolution) const
void switchIRCamera(int cam)
OBCameraParams m_CamParams
boost::function< void(sensor_msgs::ImagePtr image)> FrameCallbackFunction
const AstraVideoMode getIRVideoMode()
void setColorVideoMode(const AstraVideoMode &video_mode)
std::vector< AstraVideoMode > color_video_modes_
const std::string getUri() const
void setColorFrameCallback(FrameCallbackFunction callback)
bool isColorVideoModeSupported(const AstraVideoMode &video_mode) const
bool isCameraParamsValid()
boost::shared_ptr< openni::VideoStream > getIRVideoStream() const
const AstraVideoMode getColorVideoMode()
boost::shared_ptr< openni::VideoStream > color_video_stream_
AstraDevice(const std::string &device_URI)
float getDepthFocalLength(int output_y_resolution) const
const std::string getName() const
const AstraVideoMode getDepthVideoMode()
std::vector< AstraVideoMode > depth_video_modes_
void setImageRegistrationMode(bool enabled)
boost::shared_ptr< openni::VideoStream > getColorVideoStream() const
bool getAutoExposure() const
void setIRFlood(bool enable)
boost::shared_ptr< openni::VideoStream > ir_video_stream_
void setIRExposure(int exposure)
const std::vector< AstraVideoMode > & getSupportedColorVideoModes() const
bool getAutoWhiteBalance() const
OB_DEVICE_NO device_type_no
boost::shared_ptr< openni::DeviceInfo > device_info_
bool depth_video_started_
bool image_registration_activated_
boost::shared_ptr< openni::Device > openni_device_
bool isColorStreamStarted()
T param(const std::string ¶m_name, const T &default_val)
float getIRFocalLength(int output_y_resolution) const
bool color_video_started_
typedef void(ONI_CALLBACK_TYPE *DeviceConnectedCallback)(const OniDeviceInfo *
OB_DEVICE_NO getDeviceTypeNo()
bool hasColorSensor() const
void setDepthColorSync(bool enabled)
bool isImageRegistrationModeSupported() const
void setAutoWhiteBalance(bool enable)
const std::vector< AstraVideoMode > & getSupportedDepthVideoModes() const
void setDepthFrameCallback(FrameCallbackFunction callback)
const std::string getVendor() const
void setDepthVideoMode(const AstraVideoMode &video_mode)