#include <ir_ros_i.h>

Public Member Functions | |
| IRRosI (ros::NodeHandle nh, ros::NodeHandle nh_private) | |
Private Member Functions | |
| void | codeHandler (unsigned char *data, int dataLength, int bitCount, int repeat) |
| void | initDevice () |
Private Attributes | |
| ros::NodeHandle | nh_ |
| ros::NodeHandle | nh_private_ |
Definition at line 9 of file ir_ros_i.h.
| phidgets::IRRosI::IRRosI | ( | ros::NodeHandle | nh, |
| ros::NodeHandle | nh_private | ||
| ) |
Definition at line 5 of file ir_ros_i.cpp.
| void phidgets::IRRosI::codeHandler | ( | unsigned char * | data, |
| int | dataLength, | ||
| int | bitCount, | ||
| int | repeat | ||
| ) | [private, virtual] |
Reimplemented from phidgets::IR.
Definition at line 30 of file ir_ros_i.cpp.
| void phidgets::IRRosI::initDevice | ( | ) | [private] |
Definition at line 15 of file ir_ros_i.cpp.
ros::NodeHandle phidgets::IRRosI::nh_ [private] |
Definition at line 18 of file ir_ros_i.h.
ros::NodeHandle phidgets::IRRosI::nh_private_ [private] |
Definition at line 19 of file ir_ros_i.h.