#include "ros/ros.h"
#include "std_msgs/Bool.h"
#include "sensor_msgs/Range.h"
#include <libphidgets/phidget21.h>
#include <sstream>
Go to the source code of this file.
Classes | |
class | Sensor |
Functions | |
void | display_generic_properties (CPhidgetHandle phid) |
int | IFK_AttachHandler (CPhidgetHandle IFK, void *userptr) |
int | IFK_SensorChangeHandler (CPhidgetInterfaceKitHandle IFK, void *userptr, int Index, int Value) |
int | main (int argc, char **argv) |
void display_generic_properties | ( | CPhidgetHandle | phid | ) |
Definition at line 74 of file phidgets_range_sensors.cpp.
int IFK_AttachHandler | ( | CPhidgetHandle | IFK, |
void * | userptr | ||
) |
Definition at line 89 of file phidgets_range_sensors.cpp.
int IFK_SensorChangeHandler | ( | CPhidgetInterfaceKitHandle | IFK, |
void * | userptr, | ||
int | Index, | ||
int | Value | ||
) |
Definition at line 96 of file phidgets_range_sensors.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 106 of file phidgets_range_sensors.cpp.