ir_ros_i.h
Go to the documentation of this file.
00001 #ifndef PHIDGETS_IR_IR_ROS_I_H
00002 #define PHIDGETS_IR_IR_ROS_I_H
00003 
00004 #include <ros/ros.h>
00005 #include <phidgets_api/ir.h>
00006 
00007 namespace phidgets {
00008 
00009 class IRRosI : public IR
00010 {
00011 
00012   public:
00013 
00014     IRRosI(ros::NodeHandle nh, ros::NodeHandle nh_private);
00015 
00016   private:
00017 
00018     ros::NodeHandle nh_;
00019     ros::NodeHandle nh_private_;
00020 
00021     void initDevice();
00022     void codeHandler(unsigned char *data, int dataLength, int bitCount, int repeat);
00023 };
00024 
00025 } //namespace phidgets
00026 
00027 #endif // PHIDGETS_IR_IR_ROS_I_H


phidgets_ir
Author(s): Ivan Dryanovski
autogenerated on Thu Jun 6 2019 21:57:54