phidget21.h File Reference

Go to the source code of this file.

Classes

struct  _CPhidget_Timestamp
struct  _CPhidgetIR_CodeInfo
struct  _CPhidgetSpatial_SpatialEventData

Defines

#define CPHIDGET_CONSTANTS
#define PFALSE   0x00
#define PTRUE   0x01
Phidget Error Event Codes

Returned in the Phidget error event

#define EEPHIDGET_BADPASSWORD   EEPHIDGET_EVENT_ERROR(0x0002)
#define EEPHIDGET_BADPOWER   EEPHIDGET_EVENT_ERROR(0x1008)
#define EEPHIDGET_BADVERSION   EEPHIDGET_EVENT_ERROR(0x0003)
#define EEPHIDGET_EVENT_ERROR(code)   (0x8000 + code)
#define EEPHIDGET_NETWORK   EEPHIDGET_EVENT_ERROR(0x0001)
#define EEPHIDGET_OUTOFRANGE   EEPHIDGET_EVENT_ERROR(0x1007)
#define EEPHIDGET_OVERCURRENT   EEPHIDGET_EVENT_ERROR(0x1006)
#define EEPHIDGET_OVERRUN   EEPHIDGET_EVENT_ERROR(0x1002)
#define EEPHIDGET_OVERTEMP   EEPHIDGET_EVENT_ERROR(0x1005)
#define EEPHIDGET_PACKETLOST   EEPHIDGET_EVENT_ERROR(0x1003)
#define EEPHIDGET_WRAP   EEPHIDGET_EVENT_ERROR(0x1004)
Phidget Error Codes

Returned by all C API calls

#define EPHIDGET_BADPASSWORD   10
#define EPHIDGET_BADVERSION   19
#define EPHIDGET_CLOSED   18
#define EPHIDGET_DUPLICATE   12
#define EPHIDGET_EVENT   15
#define EPHIDGET_INTERRUPTED   6
#define EPHIDGET_INVALID   7
#define EPHIDGET_INVALIDARG   4
#define EPHIDGET_NETWORK   8
#define EPHIDGET_NETWORK_NOTCONNECTED   16
#define EPHIDGET_NOMEMORY   2
#define EPHIDGET_NOTATTACHED   5
#define EPHIDGET_NOTFOUND   1
#define EPHIDGET_OK   0
#define EPHIDGET_OUTOFBOUNDS   14
#define EPHIDGET_TIMEOUT   13
#define EPHIDGET_UNEXPECTED   3
#define EPHIDGET_UNKNOWNVAL   9
#define EPHIDGET_UNSUPPORTED   11
#define EPHIDGET_WRONGDEVICE   17
#define PHIDGET_ERROR_CODE_COUNT   20
Phidget States

Returned by getStatus() functions

#define PHIDGET_ATTACHED   0x1
#define PHIDGET_NOTATTACHED   0x0
Phidget Unknown Constants

Data values will be set to these constants when a call fails with EPHIDGET_UNKNOWNVAL.

#define PUNK_BOOL   0x02
#define PUNK_DBL   1e300
#define PUNK_FLT   1e30
#define PUNK_INT   0x7FFFFFFF
#define PUNK_INT64   0x7FFFFFFFFFFFFFFFLL
#define PUNK_SHRT   0x7FFF

Typedefs

typedef long long __int64
typedef struct _CPhidget_Timestamp CPhidget_Timestamp
typedef struct
_CPhidget_Timestamp
CPhidget_TimestampHandle
typedef struct
_CPhidgetAccelerometer * 
CPhidgetAccelerometerHandle
typedef struct
_CPhidgetAdvancedServo * 
CPhidgetAdvancedServoHandle
typedef int(* CPhidgetDictionary_OnKeyChange_Function )(CPhidgetDictionaryHandle dict, void *userPtr, const char *key, const char *value, CPhidgetDictionary_keyChangeReason reason)
typedef struct
_CPhidgetDictionary * 
CPhidgetDictionaryHandle
typedef struct
_CPhidgetDictionaryListener * 
CPhidgetDictionaryListenerHandle
typedef struct _CPhidgetEncoder * CPhidgetEncoderHandle
typedef struct _CPhidget * CPhidgetHandle
typedef struct
_CPhidgetInterfaceKit * 
CPhidgetInterfaceKitHandle
typedef struct _CPhidgetIR_CodeInfo CPhidgetIR_CodeInfo
typedef struct
_CPhidgetIR_CodeInfo
CPhidgetIR_CodeInfoHandle
typedef struct _CPhidgetIR * CPhidgetIRHandle
typedef struct _CPhidgetLED * CPhidgetLEDHandle
typedef struct _CPhidgetManager * CPhidgetManagerHandle
typedef struct
_CPhidgetMotorControl * 
CPhidgetMotorControlHandle
typedef struct _CPhidgetPHSensor * CPhidgetPHSensorHandle
typedef struct _CPhidgetRFID * CPhidgetRFIDHandle
typedef struct _CPhidgetServo * CPhidgetServoHandle
typedef struct
_CPhidgetSpatial_SpatialEventData 
CPhidgetSpatial_SpatialEventData
typedef struct
_CPhidgetSpatial_SpatialEventData
CPhidgetSpatial_SpatialEventDataHandle
typedef struct _CPhidgetSpatial * CPhidgetSpatialHandle
typedef struct _CPhidgetStepper * CPhidgetStepperHandle
typedef struct
_CPhidgetTemperatureSensor * 
CPhidgetTemperatureSensorHandle
typedef struct _CPhidgetTextLCD * CPhidgetTextLCDHandle
typedef struct _CPhidgetTextLED * CPhidgetTextLEDHandle
typedef struct
_CPhidgetWeightSensor * 
CPhidgetWeightSensorHandle

Enumerations

enum  CPhidget_DeviceClass {
  PHIDCLASS_ACCELEROMETER = 2, PHIDCLASS_ADVANCEDSERVO = 3, PHIDCLASS_ENCODER = 4, PHIDCLASS_INTERFACEKIT = 7,
  PHIDCLASS_IR = 19, PHIDCLASS_LED = 8, PHIDCLASS_MOTORCONTROL = 9, PHIDCLASS_PHSENSOR = 10,
  PHIDCLASS_RFID = 11, PHIDCLASS_SERVO = 12, PHIDCLASS_STEPPER = 13, PHIDCLASS_TEMPERATURESENSOR = 14,
  PHIDCLASS_TEXTLCD = 15, PHIDCLASS_TEXTLED = 16, PHIDCLASS_WEIGHTSENSOR = 17, PHIDCLASS_SPATIAL = 20
}
enum  CPhidget_DeviceID {
  PHIDID_ACCELEROMETER_3AXIS = 0x07E, PHIDID_ADVANCEDSERVO_1MOTOR = 0x082, PHIDID_ADVANCEDSERVO_8MOTOR = 0x03A, PHIDID_BIPOLAR_STEPPER_1MOTOR = 0x07B,
  PHIDID_ENCODER_1ENCODER_1INPUT = 0x04B, PHIDID_ENCODER_HS_1ENCODER = 0x080, PHIDID_ENCODER_HS_4ENCODER_4INPUT = 0x04F, PHIDID_INTERFACEKIT_0_0_4 = 0x040,
  PHIDID_INTERFACEKIT_0_0_8 = 0x081, PHIDID_INTERFACEKIT_0_16_16 = 0x044, PHIDID_INTERFACEKIT_8_8_8 = 0x045, PHIDID_INTERFACEKIT_8_8_8_w_LCD = 0x07D,
  PHIDID_IR = 0x04D, PHIDID_LED_64 = 0x04A, PHIDID_LED_64_ADV = 0x04C, PHIDID_LINEAR_TOUCH = 0x076,
  PHIDID_MOTORCONTROL_HC_2MOTOR = 0x059, PHIDID_MOTORCONTROL_LV_2MOTOR_4INPUT = 0x058, PHIDID_PHSENSOR = 0x074, PHIDID_RFID_2OUTPUT = 0x031,
  PHIDID_ROTARY_TOUCH = 0x077, PHIDID_SERVO_1MOTOR = 0x039, PHIDID_SPATIAL_ACCEL_3AXIS = 0x07F, PHIDID_SPATIAL_ACCEL_GYRO_COMPASS = 0x033,
  PHIDID_TEMPERATURESENSOR = 0x070, PHIDID_TEMPERATURESENSOR_4 = 0x032, PHIDID_TEXTLCD_2x20_w_8_8_8 = 0x17D, PHIDID_UNIPOLAR_STEPPER_4MOTOR = 0x07A,
  PHIDID_ACCELEROMETER_2AXIS = 0x071, PHIDID_INTERFACEKIT_0_8_8_w_LCD = 0x053, PHIDID_INTERFACEKIT_4_8_8 = 4, PHIDID_RFID = 0x030,
  PHIDID_SERVO_1MOTOR_OLD = 2, PHIDID_SERVO_4MOTOR = 0x038, PHIDID_SERVO_4MOTOR_OLD = 3, PHIDID_TEXTLCD_2x20 = 0x052,
  PHIDID_TEXTLCD_2x20_w_0_8_8 = 0x153, PHIDID_TEXTLED_1x8 = 0x049, PHIDID_TEXTLED_4x8 = 0x048, PHIDID_WEIGHTSENSOR = 0x072
}
enum  CPhidget_ServoType {
  PHIDGET_SERVO_DEFAULT = 1, PHIDGET_SERVO_RAW_us_MODE, PHIDGET_SERVO_HITEC_HS322HD, PHIDGET_SERVO_HITEC_HS5245MG,
  PHIDGET_SERVO_HITEC_805BB, PHIDGET_SERVO_HITEC_HS422, PHIDGET_SERVO_TOWERPRO_MG90, PHIDGET_SERVO_HITEC_HSR1425CR,
  PHIDGET_SERVO_HITEC_HS785HB, PHIDGET_SERVO_HITEC_HS485HB, PHIDGET_SERVO_HITEC_HS645MG, PHIDGET_SERVO_HITEC_815BB,
  PHIDGET_SERVO_FIRGELLI_L12_30_50_06_R, PHIDGET_SERVO_FIRGELLI_L12_50_100_06_R, PHIDGET_SERVO_FIRGELLI_L12_50_210_06_R, PHIDGET_SERVO_FIRGELLI_L12_100_50_06_R,
  PHIDGET_SERVO_FIRGELLI_L12_100_100_06_R, PHIDGET_SERVO_USER_DEFINED
}
enum  CPhidgetDictionary_keyChangeReason { PHIDGET_DICTIONARY_VALUE_CHANGED = 1, PHIDGET_DICTIONARY_ENTRY_ADDED, PHIDGET_DICTIONARY_ENTRY_REMOVING, PHIDGET_DICTIONARY_CURRENT_VALUE }
enum  CPhidgetIR_Encoding {
  PHIDGET_IR_ENCODING_UNKNOWN = 1, PHIDGET_IR_ENCODING_SPACE, PHIDGET_IR_ENCODING_PULSE, PHIDGET_IR_ENCODING_BIPHASE,
  PHIDGET_IR_ENCODING_RC5, PHIDGET_IR_ENCODING_RC6
}
enum  CPhidgetIR_Length { PHIDGET_IR_LENGTH_UNKNOWN = 1, PHIDGET_IR_LENGTH_CONSTANT, PHIDGET_IR_LENGTH_VARIABLE }
enum  CPhidgetLED_CurrentLimit { PHIDGET_LED_CURRENT_LIMIT_20mA = 1, PHIDGET_LED_CURRENT_LIMIT_40mA, PHIDGET_LED_CURRENT_LIMIT_60mA, PHIDGET_LED_CURRENT_LIMIT_80mA }
enum  CPhidgetLED_Voltage { PHIDGET_LED_VOLTAGE_1_7V = 1, PHIDGET_LED_VOLTAGE_2_75V, PHIDGET_LED_VOLTAGE_3_9V, PHIDGET_LED_VOLTAGE_5_0V }
enum  CPhidgetLog_level {
  PHIDGET_LOG_CRITICAL = 1, PHIDGET_LOG_ERROR, PHIDGET_LOG_WARNING, PHIDGET_LOG_DEBUG,
  PHIDGET_LOG_INFO, PHIDGET_LOG_VERBOSE
}
enum  CPhidgetTemperatureSensor_ThermocoupleType { PHIDGET_TEMPERATURE_SENSOR_K_TYPE = 1, PHIDGET_TEMPERATURE_SENSOR_J_TYPE, PHIDGET_TEMPERATURE_SENSOR_E_TYPE, PHIDGET_TEMPERATURE_SENSOR_T_TYPE }

Functions

int CPhidget_close (CPhidgetHandle phid)
int CPhidget_delete (CPhidgetHandle phid)
int CPhidget_disableLogging ()
int CPhidget_enableLogging (CPhidgetLog_level level, const char *outputFile)
int CPhidget_getDeviceClass (CPhidgetHandle phid, CPhidget_DeviceClass *deviceClass)
int CPhidget_getDeviceID (CPhidgetHandle phid, CPhidget_DeviceID *deviceID)
int CPhidget_getDeviceLabel (CPhidgetHandle phid, const char **deviceLabel)
int CPhidget_getDeviceName (CPhidgetHandle phid, const char **deviceName)
int CPhidget_getDeviceStatus (CPhidgetHandle phid, int *deviceStatus)
int CPhidget_getDeviceType (CPhidgetHandle phid, const char **deviceType)
int CPhidget_getDeviceVersion (CPhidgetHandle phid, int *deviceVersion)
int CPhidget_getErrorDescription (int errorCode, const char **errorString)
int CPhidget_getLibraryVersion (const char **libraryVersion)
int CPhidget_getSerialNumber (CPhidgetHandle phid, int *serialNumber)
int CPhidget_getServerAddress (CPhidgetHandle phid, const char **address, int *port)
int CPhidget_getServerID (CPhidgetHandle phid, const char **serverID)
int CPhidget_getServerStatus (CPhidgetHandle phid, int *serverStatus)
int CPhidget_log (CPhidgetLog_level level, const char *id, const char *message,...)
int CPhidget_open (CPhidgetHandle phid, int serialNumber)
int CPhidget_openRemote (CPhidgetHandle phid, int serial, const char *serverID, const char *password)
int CPhidget_openRemoteIP (CPhidgetHandle phid, int serial, const char *address, int port, const char *password)
int CPhidget_set_OnAttach_Handler (CPhidgetHandle phid, int(*fptr)(CPhidgetHandle phid, void *userPtr), void *userPtr)
int CPhidget_set_OnDetach_Handler (CPhidgetHandle phid, int(*fptr)(CPhidgetHandle phid, void *userPtr), void *userPtr)
int CPhidget_set_OnError_Handler (CPhidgetHandle phid, int(*fptr)(CPhidgetHandle phid, void *userPtr, int errorCode, const char *errorString), void *userPtr)
int CPhidget_set_OnServerConnect_Handler (CPhidgetHandle phid, int(*fptr)(CPhidgetHandle phid, void *userPtr), void *userPtr)
int CPhidget_set_OnServerDisconnect_Handler (CPhidgetHandle phid, int(*fptr)(CPhidgetHandle phid, void *userPtr), void *userPtr)
int CPhidget_setDeviceLabel (CPhidgetHandle phid, const char *deviceLabel)
int CPhidget_waitForAttachment (CPhidgetHandle phid, int milliseconds)
int CPhidgetAccelerometer_create (CPhidgetAccelerometerHandle *phid)
int CPhidgetAccelerometer_getAcceleration (CPhidgetAccelerometerHandle phid, int index, double *acceleration)
int CPhidgetAccelerometer_getAccelerationChangeTrigger (CPhidgetAccelerometerHandle phid, int index, double *trigger)
int CPhidgetAccelerometer_getAccelerationMax (CPhidgetAccelerometerHandle phid, int index, double *max)
int CPhidgetAccelerometer_getAccelerationMin (CPhidgetAccelerometerHandle phid, int index, double *min)
int CPhidgetAccelerometer_getAxisCount (CPhidgetAccelerometerHandle phid, int *count)
int CPhidgetAccelerometer_set_OnAccelerationChange_Handler (CPhidgetAccelerometerHandle phid, int(*fptr)(CPhidgetAccelerometerHandle phid, void *userPtr, int index, double acceleration), void *userPtr)
int CPhidgetAccelerometer_setAccelerationChangeTrigger (CPhidgetAccelerometerHandle phid, int index, double trigger)
int CPhidgetAdvancedServo_create (CPhidgetAdvancedServoHandle *phid)
int CPhidgetAdvancedServo_getAcceleration (CPhidgetAdvancedServoHandle phid, int index, double *acceleration)
int CPhidgetAdvancedServo_getAccelerationMax (CPhidgetAdvancedServoHandle phid, int index, double *max)
int CPhidgetAdvancedServo_getAccelerationMin (CPhidgetAdvancedServoHandle phid, int index, double *min)
int CPhidgetAdvancedServo_getCurrent (CPhidgetAdvancedServoHandle phid, int index, double *current)
int CPhidgetAdvancedServo_getEngaged (CPhidgetAdvancedServoHandle phid, int index, int *engagedState)
int CPhidgetAdvancedServo_getMotorCount (CPhidgetAdvancedServoHandle phid, int *count)
int CPhidgetAdvancedServo_getPosition (CPhidgetAdvancedServoHandle phid, int index, double *position)
int CPhidgetAdvancedServo_getPositionMax (CPhidgetAdvancedServoHandle phid, int index, double *max)
int CPhidgetAdvancedServo_getPositionMin (CPhidgetAdvancedServoHandle phid, int index, double *min)
int CPhidgetAdvancedServo_getServoType (CPhidgetAdvancedServoHandle phid, int index, CPhidget_ServoType *servoType)
int CPhidgetAdvancedServo_getSpeedRampingOn (CPhidgetAdvancedServoHandle phid, int index, int *rampingState)
int CPhidgetAdvancedServo_getStopped (CPhidgetAdvancedServoHandle phid, int index, int *stoppedState)
int CPhidgetAdvancedServo_getVelocity (CPhidgetAdvancedServoHandle phid, int index, double *velocity)
int CPhidgetAdvancedServo_getVelocityLimit (CPhidgetAdvancedServoHandle phid, int index, double *limit)
int CPhidgetAdvancedServo_getVelocityMax (CPhidgetAdvancedServoHandle phid, int index, double *max)
int CPhidgetAdvancedServo_getVelocityMin (CPhidgetAdvancedServoHandle phid, int index, double *min)
int CPhidgetAdvancedServo_set_OnCurrentChange_Handler (CPhidgetAdvancedServoHandle phid, int(*fptr)(CPhidgetAdvancedServoHandle phid, void *userPtr, int index, double current), void *userPtr)
int CPhidgetAdvancedServo_set_OnPositionChange_Handler (CPhidgetAdvancedServoHandle phid, int(*fptr)(CPhidgetAdvancedServoHandle phid, void *userPtr, int index, double position), void *userPtr)
int CPhidgetAdvancedServo_set_OnVelocityChange_Handler (CPhidgetAdvancedServoHandle phid, int(*fptr)(CPhidgetAdvancedServoHandle phid, void *userPtr, int index, double velocity), void *userPtr)
int CPhidgetAdvancedServo_setAcceleration (CPhidgetAdvancedServoHandle phid, int index, double acceleration)
int CPhidgetAdvancedServo_setEngaged (CPhidgetAdvancedServoHandle phid, int index, int engagedState)
int CPhidgetAdvancedServo_setPosition (CPhidgetAdvancedServoHandle phid, int index, double position)
int CPhidgetAdvancedServo_setPositionMax (CPhidgetAdvancedServoHandle phid, int index, double max)
int CPhidgetAdvancedServo_setPositionMin (CPhidgetAdvancedServoHandle phid, int index, double min)
int CPhidgetAdvancedServo_setServoParameters (CPhidgetAdvancedServoHandle phid, int index, double min_us, double max_us, double degrees, double velocity_max)
int CPhidgetAdvancedServo_setServoType (CPhidgetAdvancedServoHandle phid, int index, CPhidget_ServoType servoType)
int CPhidgetAdvancedServo_setSpeedRampingOn (CPhidgetAdvancedServoHandle phid, int index, int rampingState)
int CPhidgetAdvancedServo_setVelocityLimit (CPhidgetAdvancedServoHandle phid, int index, double limit)
int CPhidgetDictionary_addKey (CPhidgetDictionaryHandle dict, const char *key, const char *value, int persistent)
int CPhidgetDictionary_close (CPhidgetDictionaryHandle dict)
int CPhidgetDictionary_create (CPhidgetDictionaryHandle *dict)
int CPhidgetDictionary_delete (CPhidgetDictionaryHandle dict)
int CPhidgetDictionary_getKey (CPhidgetDictionaryHandle dict, const char *key, char *value, int valuelen)
int CPhidgetDictionary_getServerAddress (CPhidgetDictionaryHandle dict, const char **address, int *port)
int CPhidgetDictionary_getServerID (CPhidgetDictionaryHandle dict, const char **serverID)
int CPhidgetDictionary_getServerStatus (CPhidgetDictionaryHandle dict, int *serverStatus)
int CPhidgetDictionary_openRemote (CPhidgetDictionaryHandle dict, const char *serverID, const char *password)
int CPhidgetDictionary_openRemoteIP (CPhidgetDictionaryHandle dict, const char *address, int port, const char *password)
int CPhidgetDictionary_remove_OnKeyChange_Handler (CPhidgetDictionaryListenerHandle dictlistener)
int CPhidgetDictionary_removeKey (CPhidgetDictionaryHandle dict, const char *pattern)
int CPhidgetDictionary_set_OnError_Handler (CPhidgetDictionaryHandle dict, int(*fptr)(CPhidgetDictionaryHandle, void *userPtr, int errorCode, const char *errorString), void *userPtr)
int CPhidgetDictionary_set_OnKeyChange_Handler (CPhidgetDictionaryHandle dict, CPhidgetDictionaryListenerHandle *dictlistener, const char *pattern, CPhidgetDictionary_OnKeyChange_Function fptr, void *userPtr)
int CPhidgetDictionary_set_OnServerConnect_Handler (CPhidgetDictionaryHandle dict, int(*fptr)(CPhidgetDictionaryHandle dict, void *userPtr), void *userPtr)
int CPhidgetDictionary_set_OnServerDisconnect_Handler (CPhidgetDictionaryHandle dict, int(*fptr)(CPhidgetDictionaryHandle dict, void *userPtr), void *userPtr)
int CPhidgetEncoder_create (CPhidgetEncoderHandle *phid)
int CPhidgetEncoder_getEnabled (CPhidgetEncoderHandle phid, int index, int *enabledState)
int CPhidgetEncoder_getEncoderCount (CPhidgetEncoderHandle phid, int *count)
int CPhidgetEncoder_getIndexPosition (CPhidgetEncoderHandle phid, int index, int *position)
int CPhidgetEncoder_getInputCount (CPhidgetEncoderHandle phid, int *count)
int CPhidgetEncoder_getInputState (CPhidgetEncoderHandle phid, int index, int *inputState)
int CPhidgetEncoder_getPosition (CPhidgetEncoderHandle phid, int index, int *position)
int CPhidgetEncoder_set_OnInputChange_Handler (CPhidgetEncoderHandle phid, int(*fptr)(CPhidgetEncoderHandle phid, void *userPtr, int index, int inputState), void *userPtr)
int CPhidgetEncoder_set_OnPositionChange_Handler (CPhidgetEncoderHandle phid, int(*fptr)(CPhidgetEncoderHandle phid, void *userPtr, int index, int time, int positionChange), void *userPtr)
int CPhidgetEncoder_setEnabled (CPhidgetEncoderHandle phid, int index, int enabledState)
int CPhidgetEncoder_setPosition (CPhidgetEncoderHandle phid, int index, int position)
int CPhidgetInterfaceKit_create (CPhidgetInterfaceKitHandle *phid)
int CPhidgetInterfaceKit_getDataRate (CPhidgetInterfaceKitHandle phid, int index, int *milliseconds)
int CPhidgetInterfaceKit_getDataRateMax (CPhidgetInterfaceKitHandle phid, int index, int *max)
int CPhidgetInterfaceKit_getDataRateMin (CPhidgetInterfaceKitHandle phid, int index, int *min)
int CPhidgetInterfaceKit_getInputCount (CPhidgetInterfaceKitHandle phid, int *count)
int CPhidgetInterfaceKit_getInputState (CPhidgetInterfaceKitHandle phid, int index, int *inputState)
int CPhidgetInterfaceKit_getOutputCount (CPhidgetInterfaceKitHandle phid, int *count)
int CPhidgetInterfaceKit_getOutputState (CPhidgetInterfaceKitHandle phid, int index, int *outputState)
int CPhidgetInterfaceKit_getRatiometric (CPhidgetInterfaceKitHandle phid, int *ratiometric)
int CPhidgetInterfaceKit_getSensorChangeTrigger (CPhidgetInterfaceKitHandle phid, int index, int *trigger)
int CPhidgetInterfaceKit_getSensorCount (CPhidgetInterfaceKitHandle phid, int *count)
int CPhidgetInterfaceKit_getSensorRawValue (CPhidgetInterfaceKitHandle phid, int index, int *sensorRawValue)
int CPhidgetInterfaceKit_getSensorValue (CPhidgetInterfaceKitHandle phid, int index, int *sensorValue)
int CPhidgetInterfaceKit_set_OnInputChange_Handler (CPhidgetInterfaceKitHandle phid, int(*fptr)(CPhidgetInterfaceKitHandle phid, void *userPtr, int index, int inputState), void *userPtr)
int CPhidgetInterfaceKit_set_OnOutputChange_Handler (CPhidgetInterfaceKitHandle phid, int(*fptr)(CPhidgetInterfaceKitHandle phid, void *userPtr, int index, int outputState), void *userPtr)
int CPhidgetInterfaceKit_set_OnSensorChange_Handler (CPhidgetInterfaceKitHandle phid, int(*fptr)(CPhidgetInterfaceKitHandle phid, void *userPtr, int index, int sensorValue), void *userPtr)
int CPhidgetInterfaceKit_setDataRate (CPhidgetInterfaceKitHandle phid, int index, int milliseconds)
int CPhidgetInterfaceKit_setOutputState (CPhidgetInterfaceKitHandle phid, int index, int outputState)
int CPhidgetInterfaceKit_setRatiometric (CPhidgetInterfaceKitHandle phid, int ratiometric)
int CPhidgetInterfaceKit_setSensorChangeTrigger (CPhidgetInterfaceKitHandle phid, int index, int trigger)
int CPhidgetIR_create (CPhidgetIRHandle *phid)
int CPhidgetIR_getLastCode (CPhidgetIRHandle phid, unsigned char *data, int *dataLength, int *bitCount)
int CPhidgetIR_getLastLearnedCode (CPhidgetIRHandle phid, unsigned char *data, int *dataLength, CPhidgetIR_CodeInfo *codeInfo)
int CPhidgetIR_getRawData (CPhidgetIRHandle phid, int *data, int *dataLength)
int CPhidgetIR_set_OnCode_Handler (CPhidgetIRHandle phid, int(*fptr)(CPhidgetIRHandle phid, void *userPtr, unsigned char *data, int dataLength, int bitCount, int repeat), void *userPtr)
int CPhidgetIR_set_OnLearn_Handler (CPhidgetIRHandle phid, int(*fptr)(CPhidgetIRHandle phid, void *userPtr, unsigned char *data, int dataLength, CPhidgetIR_CodeInfoHandle codeInfo), void *userPtr)
int CPhidgetIR_set_OnRawData_Handler (CPhidgetIRHandle phid, int(*fptr)(CPhidgetIRHandle phid, void *userPtr, int *data, int dataLength), void *userPtr)
int CPhidgetIR_Transmit (CPhidgetIRHandle phid, unsigned char *data, CPhidgetIR_CodeInfoHandle codeInfo)
int CPhidgetIR_TransmitRaw (CPhidgetIRHandle phid, int *data, int length, int carrierFrequency, int dutyCycle, int gap)
int CPhidgetIR_TransmitRepeat (CPhidgetIRHandle phid)
int CPhidgetLED_create (CPhidgetLEDHandle *phid)
int CPhidgetLED_getCurrentLimit (CPhidgetLEDHandle phid, CPhidgetLED_CurrentLimit *currentLimit)
int CPhidgetLED_getDiscreteLED (CPhidgetLEDHandle phid, int index, int *brightness)
int CPhidgetLED_getLEDCount (CPhidgetLEDHandle phid, int *count)
int CPhidgetLED_getVoltage (CPhidgetLEDHandle phid, CPhidgetLED_Voltage *voltage)
int CPhidgetLED_setCurrentLimit (CPhidgetLEDHandle phid, CPhidgetLED_CurrentLimit currentLimit)
int CPhidgetLED_setDiscreteLED (CPhidgetLEDHandle phid, int index, int brightness)
int CPhidgetLED_setVoltage (CPhidgetLEDHandle phid, CPhidgetLED_Voltage voltage)
int CPhidgetManager_close (CPhidgetManagerHandle phidm)
int CPhidgetManager_create (CPhidgetManagerHandle *phidm)
int CPhidgetManager_delete (CPhidgetManagerHandle phidm)
int CPhidgetManager_freeAttachedDevicesArray (CPhidgetHandle phidArray[])
int CPhidgetManager_getAttachedDevices (CPhidgetManagerHandle phidm, CPhidgetHandle *phidArray[], int *count)
int CPhidgetManager_getServerAddress (CPhidgetManagerHandle phidm, const char **address, int *port)
int CPhidgetManager_getServerID (CPhidgetManagerHandle phidm, const char **serverID)
int CPhidgetManager_getServerStatus (CPhidgetManagerHandle phidm, int *serverStatus)
int CPhidgetManager_open (CPhidgetManagerHandle phidm)
int CPhidgetManager_openRemote (CPhidgetManagerHandle phidm, const char *serverID, const char *password)
int CPhidgetManager_openRemoteIP (CPhidgetManagerHandle phidm, const char *address, int port, const char *password)
int CPhidgetManager_set_OnAttach_Handler (CPhidgetManagerHandle phidm, int(*fptr)(CPhidgetHandle phid, void *userPtr), void *userPtr)
int CPhidgetManager_set_OnDetach_Handler (CPhidgetManagerHandle phidm, int(*fptr)(CPhidgetHandle phid, void *userPtr), void *userPtr)
int CPhidgetManager_set_OnError_Handler (CPhidgetManagerHandle phidm, int(*fptr)(CPhidgetManagerHandle phidm, void *userPtr, int errorCode, const char *errorString), void *userPtr)
int CPhidgetManager_set_OnServerConnect_Handler (CPhidgetManagerHandle phidm, int(*fptr)(CPhidgetManagerHandle phidm, void *userPtr), void *userPtr)
int CPhidgetManager_set_OnServerDisconnect_Handler (CPhidgetManagerHandle phidm, int(*fptr)(CPhidgetManagerHandle phidm, void *userPtr), void *userPtr)
int CPhidgetMotorControl_create (CPhidgetMotorControlHandle *phid)
int CPhidgetMotorControl_getAcceleration (CPhidgetMotorControlHandle phid, int index, double *acceleration)
int CPhidgetMotorControl_getAccelerationMax (CPhidgetMotorControlHandle phid, int index, double *max)
int CPhidgetMotorControl_getAccelerationMin (CPhidgetMotorControlHandle phid, int index, double *min)
int CPhidgetMotorControl_getCurrent (CPhidgetMotorControlHandle phid, int index, double *current)
int CPhidgetMotorControl_getInputCount (CPhidgetMotorControlHandle phid, int *count)
int CPhidgetMotorControl_getInputState (CPhidgetMotorControlHandle phid, int index, int *inputState)
int CPhidgetMotorControl_getMotorCount (CPhidgetMotorControlHandle phid, int *count)
int CPhidgetMotorControl_getVelocity (CPhidgetMotorControlHandle phid, int index, double *velocity)
int CPhidgetMotorControl_set_OnCurrentChange_Handler (CPhidgetMotorControlHandle phid, int(*fptr)(CPhidgetMotorControlHandle phid, void *userPtr, int index, double current), void *userPtr)
int CPhidgetMotorControl_set_OnInputChange_Handler (CPhidgetMotorControlHandle phid, int(*fptr)(CPhidgetMotorControlHandle phid, void *userPtr, int index, int inputState), void *userPtr)
int CPhidgetMotorControl_set_OnVelocityChange_Handler (CPhidgetMotorControlHandle phid, int(*fptr)(CPhidgetMotorControlHandle phid, void *userPtr, int index, double velocity), void *userPtr)
int CPhidgetMotorControl_setAcceleration (CPhidgetMotorControlHandle phid, int index, double acceleration)
int CPhidgetMotorControl_setVelocity (CPhidgetMotorControlHandle phid, int index, double velocity)
int CPhidgetPHSensor_create (CPhidgetPHSensorHandle *phid)
int CPhidgetPHSensor_getPH (CPhidgetPHSensorHandle phid, double *ph)
int CPhidgetPHSensor_getPHChangeTrigger (CPhidgetPHSensorHandle phid, double *trigger)
int CPhidgetPHSensor_getPHMax (CPhidgetPHSensorHandle phid, double *max)
int CPhidgetPHSensor_getPHMin (CPhidgetPHSensorHandle phid, double *min)
int CPhidgetPHSensor_getPotential (CPhidgetPHSensorHandle phid, double *potential)
int CPhidgetPHSensor_getPotentialMax (CPhidgetPHSensorHandle phid, double *max)
int CPhidgetPHSensor_getPotentialMin (CPhidgetPHSensorHandle phid, double *min)
int CPhidgetPHSensor_set_OnPHChange_Handler (CPhidgetPHSensorHandle phid, int(*fptr)(CPhidgetPHSensorHandle phid, void *userPtr, double ph), void *userPtr)
int CPhidgetPHSensor_setPHChangeTrigger (CPhidgetPHSensorHandle phid, double trigger)
int CPhidgetPHSensor_setTemperature (CPhidgetPHSensorHandle phid, double temperature)
int CPhidgetRFID_create (CPhidgetRFIDHandle *phid)
int CPhidgetRFID_getAntennaOn (CPhidgetRFIDHandle phid, int *antennaState)
int CPhidgetRFID_getLastTag (CPhidgetRFIDHandle phid, unsigned char *tag)
int CPhidgetRFID_getLEDOn (CPhidgetRFIDHandle phid, int *LEDState)
int CPhidgetRFID_getOutputCount (CPhidgetRFIDHandle phid, int *count)
int CPhidgetRFID_getOutputState (CPhidgetRFIDHandle phid, int index, int *outputState)
int CPhidgetRFID_getTagStatus (CPhidgetRFIDHandle phid, int *status)
int CPhidgetRFID_set_OnOutputChange_Handler (CPhidgetRFIDHandle phid, int(*fptr)(CPhidgetRFIDHandle phid, void *userPtr, int index, int outputState), void *userPtr)
int CPhidgetRFID_set_OnTag_Handler (CPhidgetRFIDHandle phid, int(*fptr)(CPhidgetRFIDHandle phid, void *userPtr, unsigned char *tag), void *userPtr)
int CPhidgetRFID_set_OnTagLost_Handler (CPhidgetRFIDHandle phid, int(*fptr)(CPhidgetRFIDHandle phid, void *userPtr, unsigned char *tag), void *userPtr)
int CPhidgetRFID_setAntennaOn (CPhidgetRFIDHandle phid, int antennaState)
int CPhidgetRFID_setLEDOn (CPhidgetRFIDHandle phid, int LEDState)
int CPhidgetRFID_setOutputState (CPhidgetRFIDHandle phid, int index, int outputState)
int CPhidgetServo_create (CPhidgetServoHandle *phid)
int CPhidgetServo_getEngaged (CPhidgetServoHandle phid, int index, int *engagedState)
int CPhidgetServo_getMotorCount (CPhidgetServoHandle phid, int *count)
int CPhidgetServo_getPosition (CPhidgetServoHandle phid, int index, double *position)
int CPhidgetServo_getPositionMax (CPhidgetServoHandle phid, int index, double *max)
int CPhidgetServo_getPositionMin (CPhidgetServoHandle phid, int index, double *min)
int CPhidgetServo_getServoType (CPhidgetServoHandle phid, int index, CPhidget_ServoType *servoType)
int CPhidgetServo_set_OnPositionChange_Handler (CPhidgetServoHandle phid, int(*fptr)(CPhidgetServoHandle phid, void *userPtr, int index, double position), void *userPtr)
int CPhidgetServo_setEngaged (CPhidgetServoHandle phid, int index, int engagedState)
int CPhidgetServo_setPosition (CPhidgetServoHandle phid, int index, double position)
int CPhidgetServo_setServoParameters (CPhidgetServoHandle phid, int index, double min_us, double max_us, double degrees)
int CPhidgetServo_setServoType (CPhidgetServoHandle phid, int index, CPhidget_ServoType servoType)
int CPhidgetSpatial_create (CPhidgetSpatialHandle *phid)
int CPhidgetSpatial_getAcceleration (CPhidgetSpatialHandle phid, int index, double *acceleration)
int CPhidgetSpatial_getAccelerationAxisCount (CPhidgetSpatialHandle phid, int *count)
int CPhidgetSpatial_getAccelerationMax (CPhidgetSpatialHandle phid, int index, double *max)
int CPhidgetSpatial_getAccelerationMin (CPhidgetSpatialHandle phid, int index, double *min)
int CPhidgetSpatial_getAngularRate (CPhidgetSpatialHandle phid, int index, double *angularRate)
int CPhidgetSpatial_getAngularRateMax (CPhidgetSpatialHandle phid, int index, double *max)
int CPhidgetSpatial_getAngularRateMin (CPhidgetSpatialHandle phid, int index, double *min)
int CPhidgetSpatial_getCompassAxisCount (CPhidgetSpatialHandle phid, int *count)
int CPhidgetSpatial_getDataRate (CPhidgetSpatialHandle phid, int *milliseconds)
int CPhidgetSpatial_getDataRateMax (CPhidgetSpatialHandle phid, int *max)
int CPhidgetSpatial_getDataRateMin (CPhidgetSpatialHandle phid, int *min)
int CPhidgetSpatial_getGyroAxisCount (CPhidgetSpatialHandle phid, int *count)
int CPhidgetSpatial_getMagneticField (CPhidgetSpatialHandle phid, int index, double *magneticField)
int CPhidgetSpatial_getMagneticFieldMax (CPhidgetSpatialHandle phid, int index, double *max)
int CPhidgetSpatial_getMagneticFieldMin (CPhidgetSpatialHandle phid, int index, double *min)
int CPhidgetSpatial_resetCompassCorrectionParameters (CPhidgetSpatialHandle phid)
int CPhidgetSpatial_set_OnSpatialData_Handler (CPhidgetSpatialHandle phid, int(*fptr)(CPhidgetSpatialHandle phid, void *userPtr, CPhidgetSpatial_SpatialEventDataHandle *data, int dataCount), void *userPtr)
int CPhidgetSpatial_setCompassCorrectionParameters (CPhidgetSpatialHandle phid, double magField, double offset0, double offset1, double offset2, double gain0, double gain1, double gain2, double T0, double T1, double T2, double T3, double T4, double T5)
int CPhidgetSpatial_setDataRate (CPhidgetSpatialHandle phid, int milliseconds)
int CPhidgetSpatial_zeroGyro (CPhidgetSpatialHandle phid)
int CPhidgetStepper_create (CPhidgetStepperHandle *phid)
int CPhidgetStepper_getAcceleration (CPhidgetStepperHandle phid, int index, double *acceleration)
int CPhidgetStepper_getAccelerationMax (CPhidgetStepperHandle phid, int index, double *max)
int CPhidgetStepper_getAccelerationMin (CPhidgetStepperHandle phid, int index, double *min)
int CPhidgetStepper_getCurrent (CPhidgetStepperHandle phid, int index, double *current)
int CPhidgetStepper_getCurrentLimit (CPhidgetStepperHandle phid, int index, double *limit)
int CPhidgetStepper_getCurrentMax (CPhidgetStepperHandle phid, int index, double *max)
int CPhidgetStepper_getCurrentMin (CPhidgetStepperHandle phid, int index, double *min)
int CPhidgetStepper_getCurrentPosition (CPhidgetStepperHandle phid, int index, __int64 *position)
int CPhidgetStepper_getEngaged (CPhidgetStepperHandle phid, int index, int *engagedState)
int CPhidgetStepper_getInputCount (CPhidgetStepperHandle phid, int *count)
int CPhidgetStepper_getInputState (CPhidgetStepperHandle phid, int index, int *inputState)
int CPhidgetStepper_getMotorCount (CPhidgetStepperHandle phid, int *count)
int CPhidgetStepper_getPositionMax (CPhidgetStepperHandle phid, int index, __int64 *max)
int CPhidgetStepper_getPositionMin (CPhidgetStepperHandle phid, int index, __int64 *min)
int CPhidgetStepper_getStopped (CPhidgetStepperHandle phid, int index, int *stoppedState)
int CPhidgetStepper_getTargetPosition (CPhidgetStepperHandle phid, int index, __int64 *position)
int CPhidgetStepper_getVelocity (CPhidgetStepperHandle phid, int index, double *velocity)
int CPhidgetStepper_getVelocityLimit (CPhidgetStepperHandle phid, int index, double *limit)
int CPhidgetStepper_getVelocityMax (CPhidgetStepperHandle phid, int index, double *max)
int CPhidgetStepper_getVelocityMin (CPhidgetStepperHandle phid, int index, double *min)
int CPhidgetStepper_set_OnCurrentChange_Handler (CPhidgetStepperHandle phid, int(*fptr)(CPhidgetStepperHandle phid, void *userPtr, int index, double current), void *userPtr)
int CPhidgetStepper_set_OnInputChange_Handler (CPhidgetStepperHandle phid, int(*fptr)(CPhidgetStepperHandle phid, void *userPtr, int index, int inputState), void *userPtr)
int CPhidgetStepper_set_OnPositionChange_Handler (CPhidgetStepperHandle phid, int(*fptr)(CPhidgetStepperHandle phid, void *userPtr, int index, __int64 position), void *userPtr)
int CPhidgetStepper_set_OnVelocityChange_Handler (CPhidgetStepperHandle phid, int(*fptr)(CPhidgetStepperHandle phid, void *userPtr, int index, double velocity), void *userPtr)
int CPhidgetStepper_setAcceleration (CPhidgetStepperHandle phid, int index, double acceleration)
int CPhidgetStepper_setCurrentLimit (CPhidgetStepperHandle phid, int index, double limit)
int CPhidgetStepper_setCurrentPosition (CPhidgetStepperHandle phid, int index, __int64 position)
int CPhidgetStepper_setEngaged (CPhidgetStepperHandle phid, int index, int engagedState)
int CPhidgetStepper_setTargetPosition (CPhidgetStepperHandle phid, int index, __int64 position)
int CPhidgetStepper_setVelocityLimit (CPhidgetStepperHandle phid, int index, double limit)
int CPhidgetTemperatureSensor_create (CPhidgetTemperatureSensorHandle *phid)
int CPhidgetTemperatureSensor_getAmbientTemperature (CPhidgetTemperatureSensorHandle phid, double *ambient)
int CPhidgetTemperatureSensor_getAmbientTemperatureMax (CPhidgetTemperatureSensorHandle phid, double *max)
int CPhidgetTemperatureSensor_getAmbientTemperatureMin (CPhidgetTemperatureSensorHandle phid, double *min)
int CPhidgetTemperatureSensor_getPotential (CPhidgetTemperatureSensorHandle phid, int index, double *potential)
int CPhidgetTemperatureSensor_getPotentialMax (CPhidgetTemperatureSensorHandle phid, int index, double *max)
int CPhidgetTemperatureSensor_getPotentialMin (CPhidgetTemperatureSensorHandle phid, int index, double *min)
int CPhidgetTemperatureSensor_getTemperature (CPhidgetTemperatureSensorHandle phid, int index, double *temperature)
int CPhidgetTemperatureSensor_getTemperatureChangeTrigger (CPhidgetTemperatureSensorHandle phid, int index, double *trigger)
int CPhidgetTemperatureSensor_getTemperatureInputCount (CPhidgetTemperatureSensorHandle phid, int *count)
int CPhidgetTemperatureSensor_getTemperatureMax (CPhidgetTemperatureSensorHandle phid, int index, double *max)
int CPhidgetTemperatureSensor_getTemperatureMin (CPhidgetTemperatureSensorHandle phid, int index, double *min)
int CPhidgetTemperatureSensor_getThermocoupleType (CPhidgetTemperatureSensorHandle phid, int index, CPhidgetTemperatureSensor_ThermocoupleType *type)
int CPhidgetTemperatureSensor_set_OnTemperatureChange_Handler (CPhidgetTemperatureSensorHandle phid, int(*fptr)(CPhidgetTemperatureSensorHandle phid, void *userPtr, int index, double temperature), void *userPtr)
int CPhidgetTemperatureSensor_setTemperatureChangeTrigger (CPhidgetTemperatureSensorHandle phid, int index, double trigger)
int CPhidgetTemperatureSensor_setThermocoupleType (CPhidgetTemperatureSensorHandle phid, int index, CPhidgetTemperatureSensor_ThermocoupleType type)
int CPhidgetTextLCD_create (CPhidgetTextLCDHandle *phid)
int CPhidgetTextLCD_getBacklight (CPhidgetTextLCDHandle phid, int *backlightState)
int CPhidgetTextLCD_getBrightness (CPhidgetTextLCDHandle phid, int *brightness)
int CPhidgetTextLCD_getColumnCount (CPhidgetTextLCDHandle phid, int *count)
int CPhidgetTextLCD_getContrast (CPhidgetTextLCDHandle phid, int *contrast)
int CPhidgetTextLCD_getCursorBlink (CPhidgetTextLCDHandle phid, int *cursorBlinkState)
int CPhidgetTextLCD_getCursorOn (CPhidgetTextLCDHandle phid, int *cursorState)
int CPhidgetTextLCD_getRowCount (CPhidgetTextLCDHandle phid, int *count)
int CPhidgetTextLCD_setBacklight (CPhidgetTextLCDHandle phid, int backlightState)
int CPhidgetTextLCD_setBrightness (CPhidgetTextLCDHandle phid, int brightness)
int CPhidgetTextLCD_setContrast (CPhidgetTextLCDHandle phid, int contrast)
int CPhidgetTextLCD_setCursorBlink (CPhidgetTextLCDHandle phid, int cursorBlinkState)
int CPhidgetTextLCD_setCursorOn (CPhidgetTextLCDHandle phid, int cursorState)
int CPhidgetTextLCD_setCustomCharacter (CPhidgetTextLCDHandle phid, int index, int var1, int var2)
int CPhidgetTextLCD_setDisplayCharacter (CPhidgetTextLCDHandle phid, int index, int column, unsigned char character)
int CPhidgetTextLCD_setDisplayString (CPhidgetTextLCDHandle phid, int index, char *displayString)
int CPhidgetTextLED_create (CPhidgetTextLEDHandle *phid)
int CPhidgetTextLED_getBrightness (CPhidgetTextLEDHandle phid, int *brightness)
int CPhidgetTextLED_getColumnCount (CPhidgetTextLEDHandle phid, int *count)
int CPhidgetTextLED_getRowCount (CPhidgetTextLEDHandle phid, int *count)
int CPhidgetTextLED_setBrightness (CPhidgetTextLEDHandle phid, int brightness)
int CPhidgetTextLED_setDisplayString (CPhidgetTextLEDHandle phid, int index, char *displayString)
int CPhidgetWeightSensor_create (CPhidgetWeightSensorHandle *phid)
int CPhidgetWeightSensor_getWeight (CPhidgetWeightSensorHandle phid, double *weight)
int CPhidgetWeightSensor_getWeightChangeTrigger (CPhidgetWeightSensorHandle phid, double *trigger)
int CPhidgetWeightSensor_set_OnWeightChange_Handler (CPhidgetWeightSensorHandle phid, int(*fptr)(CPhidgetWeightSensorHandle phid, void *userPtr, double weight), void *userPtr)
int CPhidgetWeightSensor_setWeightChangeTrigger (CPhidgetWeightSensorHandle phid, double trigger)

Define Documentation

#define CPHIDGET_CONSTANTS

Definition at line 503 of file phidget21.h.


Typedef Documentation

typedef long long __int64

Definition at line 7 of file phidget21.h.

typedef struct _CPhidgetAccelerometer* CPhidgetAccelerometerHandle

Definition at line 171 of file phidget21.h.

typedef struct _CPhidgetAdvancedServo* CPhidgetAdvancedServoHandle

Definition at line 180 of file phidget21.h.

typedef int( * CPhidgetDictionary_OnKeyChange_Function)(CPhidgetDictionaryHandle dict, void *userPtr, const char *key, const char *value, CPhidgetDictionary_keyChangeReason reason)

Definition at line 115 of file phidget21.h.

typedef struct _CPhidgetDictionary* CPhidgetDictionaryHandle

Definition at line 101 of file phidget21.h.

typedef struct _CPhidgetDictionaryListener* CPhidgetDictionaryListenerHandle

Definition at line 102 of file phidget21.h.

typedef struct _CPhidgetEncoder* CPhidgetEncoderHandle

Definition at line 240 of file phidget21.h.

typedef struct _CPhidget* CPhidgetHandle

Definition at line 6 of file phidget21.h.

typedef struct _CPhidgetInterfaceKit* CPhidgetInterfaceKitHandle

Definition at line 252 of file phidget21.h.

typedef struct _CPhidgetIR* CPhidgetIRHandle

Definition at line 273 of file phidget21.h.

typedef struct _CPhidgetLED* CPhidgetLEDHandle

Definition at line 313 of file phidget21.h.

typedef struct _CPhidgetManager* CPhidgetManagerHandle

Definition at line 126 of file phidget21.h.

typedef struct _CPhidgetMotorControl* CPhidgetMotorControlHandle

Definition at line 334 of file phidget21.h.

typedef struct _CPhidgetPHSensor* CPhidgetPHSensorHandle

Definition at line 349 of file phidget21.h.

typedef struct _CPhidgetRFID* CPhidgetRFIDHandle

Definition at line 361 of file phidget21.h.

typedef struct _CPhidgetServo* CPhidgetServoHandle

Definition at line 375 of file phidget21.h.

typedef struct _CPhidgetSpatial* CPhidgetSpatialHandle

Definition at line 388 of file phidget21.h.

typedef struct _CPhidgetStepper* CPhidgetStepperHandle

Definition at line 417 of file phidget21.h.

typedef struct _CPhidgetTemperatureSensor* CPhidgetTemperatureSensorHandle

Definition at line 449 of file phidget21.h.

typedef struct _CPhidgetTextLCD* CPhidgetTextLCDHandle

Definition at line 472 of file phidget21.h.

typedef struct _CPhidgetTextLED* CPhidgetTextLEDHandle

Definition at line 489 of file phidget21.h.

typedef struct _CPhidgetWeightSensor* CPhidgetWeightSensorHandle

Definition at line 496 of file phidget21.h.


Enumeration Type Documentation

Enumerator:
PHIDCLASS_ACCELEROMETER 
PHIDCLASS_ADVANCEDSERVO 
PHIDCLASS_ENCODER 
PHIDCLASS_INTERFACEKIT 
PHIDCLASS_IR 
PHIDCLASS_LED 
PHIDCLASS_MOTORCONTROL 
PHIDCLASS_PHSENSOR 
PHIDCLASS_RFID 
PHIDCLASS_SERVO 
PHIDCLASS_STEPPER 
PHIDCLASS_TEMPERATURESENSOR 
PHIDCLASS_TEXTLCD 
PHIDCLASS_TEXTLED 
PHIDCLASS_WEIGHTSENSOR 
PHIDCLASS_SPATIAL 

Definition at line 12 of file phidget21.h.

Enumerator:
PHIDID_ACCELEROMETER_3AXIS 
PHIDID_ADVANCEDSERVO_1MOTOR 
PHIDID_ADVANCEDSERVO_8MOTOR 
PHIDID_BIPOLAR_STEPPER_1MOTOR 
PHIDID_ENCODER_1ENCODER_1INPUT 
PHIDID_ENCODER_HS_1ENCODER 
PHIDID_ENCODER_HS_4ENCODER_4INPUT 
PHIDID_INTERFACEKIT_0_0_4 
PHIDID_INTERFACEKIT_0_0_8 
PHIDID_INTERFACEKIT_0_16_16 
PHIDID_INTERFACEKIT_8_8_8 
PHIDID_INTERFACEKIT_8_8_8_w_LCD 
PHIDID_IR 
PHIDID_LED_64 
PHIDID_LED_64_ADV 
PHIDID_LINEAR_TOUCH 
PHIDID_MOTORCONTROL_HC_2MOTOR 
PHIDID_MOTORCONTROL_LV_2MOTOR_4INPUT 
PHIDID_PHSENSOR 
PHIDID_RFID_2OUTPUT 
PHIDID_ROTARY_TOUCH 
PHIDID_SERVO_1MOTOR 
PHIDID_SPATIAL_ACCEL_3AXIS 
PHIDID_SPATIAL_ACCEL_GYRO_COMPASS 
PHIDID_TEMPERATURESENSOR 
PHIDID_TEMPERATURESENSOR_4 
PHIDID_TEXTLCD_2x20_w_8_8_8 
PHIDID_UNIPOLAR_STEPPER_4MOTOR 
PHIDID_ACCELEROMETER_2AXIS 
PHIDID_INTERFACEKIT_0_8_8_w_LCD 
PHIDID_INTERFACEKIT_4_8_8 
PHIDID_RFID 
PHIDID_SERVO_1MOTOR_OLD 
PHIDID_SERVO_4MOTOR 
PHIDID_SERVO_4MOTOR_OLD 
PHIDID_TEXTLCD_2x20 
PHIDID_TEXTLCD_2x20_w_0_8_8 
PHIDID_TEXTLED_1x8 
PHIDID_TEXTLED_4x8 
PHIDID_WEIGHTSENSOR 

Definition at line 30 of file phidget21.h.

Enumerator:
PHIDGET_SERVO_DEFAULT 
PHIDGET_SERVO_RAW_us_MODE 
PHIDGET_SERVO_HITEC_HS322HD 
PHIDGET_SERVO_HITEC_HS5245MG 
PHIDGET_SERVO_HITEC_805BB 
PHIDGET_SERVO_HITEC_HS422 
PHIDGET_SERVO_TOWERPRO_MG90 
PHIDGET_SERVO_HITEC_HSR1425CR 
PHIDGET_SERVO_HITEC_HS785HB 
PHIDGET_SERVO_HITEC_HS485HB 
PHIDGET_SERVO_HITEC_HS645MG 
PHIDGET_SERVO_HITEC_815BB 
PHIDGET_SERVO_FIRGELLI_L12_30_50_06_R 
PHIDGET_SERVO_FIRGELLI_L12_50_100_06_R 
PHIDGET_SERVO_FIRGELLI_L12_50_210_06_R 
PHIDGET_SERVO_FIRGELLI_L12_100_50_06_R 
PHIDGET_SERVO_FIRGELLI_L12_100_100_06_R 
PHIDGET_SERVO_USER_DEFINED 

Definition at line 182 of file phidget21.h.

Enumerator:
PHIDGET_DICTIONARY_VALUE_CHANGED 
PHIDGET_DICTIONARY_ENTRY_ADDED 
PHIDGET_DICTIONARY_ENTRY_REMOVING 
PHIDGET_DICTIONARY_CURRENT_VALUE 

Definition at line 95 of file phidget21.h.

Enumerator:
PHIDGET_IR_ENCODING_UNKNOWN 
PHIDGET_IR_ENCODING_SPACE 
PHIDGET_IR_ENCODING_PULSE 
PHIDGET_IR_ENCODING_BIPHASE 
PHIDGET_IR_ENCODING_RC5 
PHIDGET_IR_ENCODING_RC6 

Definition at line 275 of file phidget21.h.

Enumerator:
PHIDGET_IR_LENGTH_UNKNOWN 
PHIDGET_IR_LENGTH_CONSTANT 
PHIDGET_IR_LENGTH_VARIABLE 

Definition at line 283 of file phidget21.h.

Enumerator:
PHIDGET_LED_CURRENT_LIMIT_20mA 
PHIDGET_LED_CURRENT_LIMIT_40mA 
PHIDGET_LED_CURRENT_LIMIT_60mA 
PHIDGET_LED_CURRENT_LIMIT_80mA 

Definition at line 315 of file phidget21.h.

Enumerator:
PHIDGET_LED_VOLTAGE_1_7V 
PHIDGET_LED_VOLTAGE_2_75V 
PHIDGET_LED_VOLTAGE_3_9V 
PHIDGET_LED_VOLTAGE_5_0V 

Definition at line 321 of file phidget21.h.

Enumerator:
PHIDGET_LOG_CRITICAL 
PHIDGET_LOG_ERROR 
PHIDGET_LOG_WARNING 
PHIDGET_LOG_DEBUG 
PHIDGET_LOG_INFO 
PHIDGET_LOG_VERBOSE 

Definition at line 160 of file phidget21.h.

Enumerator:
PHIDGET_TEMPERATURE_SENSOR_K_TYPE 
PHIDGET_TEMPERATURE_SENSOR_J_TYPE 
PHIDGET_TEMPERATURE_SENSOR_E_TYPE 
PHIDGET_TEMPERATURE_SENSOR_T_TYPE 

Definition at line 451 of file phidget21.h.


Function Documentation

int CPhidget_close ( CPhidgetHandle  phid  ) 
int CPhidget_delete ( CPhidgetHandle  phid  ) 
int CPhidget_disableLogging (  ) 
int CPhidget_enableLogging ( CPhidgetLog_level  level,
const char *  outputFile 
)
int CPhidget_getDeviceClass ( CPhidgetHandle  phid,
CPhidget_DeviceClass deviceClass 
)
int CPhidget_getDeviceID ( CPhidgetHandle  phid,
CPhidget_DeviceID deviceID 
)
int CPhidget_getDeviceLabel ( CPhidgetHandle  phid,
const char **  deviceLabel 
)
int CPhidget_getDeviceName ( CPhidgetHandle  phid,
const char **  deviceName 
)
int CPhidget_getDeviceStatus ( CPhidgetHandle  phid,
int *  deviceStatus 
)
int CPhidget_getDeviceType ( CPhidgetHandle  phid,
const char **  deviceType 
)
int CPhidget_getDeviceVersion ( CPhidgetHandle  phid,
int *  deviceVersion 
)
int CPhidget_getErrorDescription ( int  errorCode,
const char **  errorString 
)
int CPhidget_getLibraryVersion ( const char **  libraryVersion  ) 
int CPhidget_getSerialNumber ( CPhidgetHandle  phid,
int *  serialNumber 
)
int CPhidget_getServerAddress ( CPhidgetHandle  phid,
const char **  address,
int *  port 
)
int CPhidget_getServerID ( CPhidgetHandle  phid,
const char **  serverID 
)
int CPhidget_getServerStatus ( CPhidgetHandle  phid,
int *  serverStatus 
)
int CPhidget_log ( CPhidgetLog_level  level,
const char *  id,
const char *  message,
  ... 
)
int CPhidget_open ( CPhidgetHandle  phid,
int  serialNumber 
)
int CPhidget_openRemote ( CPhidgetHandle  phid,
int  serial,
const char *  serverID,
const char *  password 
)
int CPhidget_openRemoteIP ( CPhidgetHandle  phid,
int  serial,
const char *  address,
int  port,
const char *  password 
)
int CPhidget_set_OnAttach_Handler ( CPhidgetHandle  phid,
int(*)(CPhidgetHandle phid, void *userPtr)  fptr,
void *  userPtr 
)
int CPhidget_set_OnDetach_Handler ( CPhidgetHandle  phid,
int(*)(CPhidgetHandle phid, void *userPtr)  fptr,
void *  userPtr 
)
int CPhidget_set_OnError_Handler ( CPhidgetHandle  phid,
int(*)(CPhidgetHandle phid, void *userPtr, int errorCode, const char *errorString)  fptr,
void *  userPtr 
)
int CPhidget_set_OnServerConnect_Handler ( CPhidgetHandle  phid,
int(*)(CPhidgetHandle phid, void *userPtr)  fptr,
void *  userPtr 
)
int CPhidget_set_OnServerDisconnect_Handler ( CPhidgetHandle  phid,
int(*)(CPhidgetHandle phid, void *userPtr)  fptr,
void *  userPtr 
)
int CPhidget_setDeviceLabel ( CPhidgetHandle  phid,
const char *  deviceLabel 
)
int CPhidget_waitForAttachment ( CPhidgetHandle  phid,
int  milliseconds 
)
int CPhidgetAccelerometer_create ( CPhidgetAccelerometerHandle phid  ) 
int CPhidgetAccelerometer_getAcceleration ( CPhidgetAccelerometerHandle  phid,
int  index,
double *  acceleration 
)
int CPhidgetAccelerometer_getAccelerationChangeTrigger ( CPhidgetAccelerometerHandle  phid,
int  index,
double *  trigger 
)
int CPhidgetAccelerometer_getAccelerationMax ( CPhidgetAccelerometerHandle  phid,
int  index,
double *  max 
)
int CPhidgetAccelerometer_getAccelerationMin ( CPhidgetAccelerometerHandle  phid,
int  index,
double *  min 
)
int CPhidgetAccelerometer_getAxisCount ( CPhidgetAccelerometerHandle  phid,
int *  count 
)
int CPhidgetAccelerometer_set_OnAccelerationChange_Handler ( CPhidgetAccelerometerHandle  phid,
int(*)(CPhidgetAccelerometerHandle phid, void *userPtr, int index, double acceleration)  fptr,
void *  userPtr 
)
int CPhidgetAccelerometer_setAccelerationChangeTrigger ( CPhidgetAccelerometerHandle  phid,
int  index,
double  trigger 
)
int CPhidgetAdvancedServo_create ( CPhidgetAdvancedServoHandle phid  ) 
int CPhidgetAdvancedServo_getAcceleration ( CPhidgetAdvancedServoHandle  phid,
int  index,
double *  acceleration 
)
int CPhidgetAdvancedServo_getAccelerationMax ( CPhidgetAdvancedServoHandle  phid,
int  index,
double *  max 
)
int CPhidgetAdvancedServo_getAccelerationMin ( CPhidgetAdvancedServoHandle  phid,
int  index,
double *  min 
)
int CPhidgetAdvancedServo_getCurrent ( CPhidgetAdvancedServoHandle  phid,
int  index,
double *  current 
)
int CPhidgetAdvancedServo_getEngaged ( CPhidgetAdvancedServoHandle  phid,
int  index,
int *  engagedState 
)
int CPhidgetAdvancedServo_getMotorCount ( CPhidgetAdvancedServoHandle  phid,
int *  count 
)
int CPhidgetAdvancedServo_getPosition ( CPhidgetAdvancedServoHandle  phid,
int  index,
double *  position 
)
int CPhidgetAdvancedServo_getPositionMax ( CPhidgetAdvancedServoHandle  phid,
int  index,
double *  max 
)
int CPhidgetAdvancedServo_getPositionMin ( CPhidgetAdvancedServoHandle  phid,
int  index,
double *  min 
)
int CPhidgetAdvancedServo_getServoType ( CPhidgetAdvancedServoHandle  phid,
int  index,
CPhidget_ServoType servoType 
)
int CPhidgetAdvancedServo_getSpeedRampingOn ( CPhidgetAdvancedServoHandle  phid,
int  index,
int *  rampingState 
)
int CPhidgetAdvancedServo_getStopped ( CPhidgetAdvancedServoHandle  phid,
int  index,
int *  stoppedState 
)
int CPhidgetAdvancedServo_getVelocity ( CPhidgetAdvancedServoHandle  phid,
int  index,
double *  velocity 
)
int CPhidgetAdvancedServo_getVelocityLimit ( CPhidgetAdvancedServoHandle  phid,
int  index,
double *  limit 
)
int CPhidgetAdvancedServo_getVelocityMax ( CPhidgetAdvancedServoHandle  phid,
int  index,
double *  max 
)
int CPhidgetAdvancedServo_getVelocityMin ( CPhidgetAdvancedServoHandle  phid,
int  index,
double *  min 
)
int CPhidgetAdvancedServo_set_OnCurrentChange_Handler ( CPhidgetAdvancedServoHandle  phid,
int(*)(CPhidgetAdvancedServoHandle phid, void *userPtr, int index, double current)  fptr,
void *  userPtr 
)
int CPhidgetAdvancedServo_set_OnPositionChange_Handler ( CPhidgetAdvancedServoHandle  phid,
int(*)(CPhidgetAdvancedServoHandle phid, void *userPtr, int index, double position)  fptr,
void *  userPtr 
)
int CPhidgetAdvancedServo_set_OnVelocityChange_Handler ( CPhidgetAdvancedServoHandle  phid,
int(*)(CPhidgetAdvancedServoHandle phid, void *userPtr, int index, double velocity)  fptr,
void *  userPtr 
)
int CPhidgetAdvancedServo_setAcceleration ( CPhidgetAdvancedServoHandle  phid,
int  index,
double  acceleration 
)
int CPhidgetAdvancedServo_setEngaged ( CPhidgetAdvancedServoHandle  phid,
int  index,
int  engagedState 
)
int CPhidgetAdvancedServo_setPosition ( CPhidgetAdvancedServoHandle  phid,
int  index,
double  position 
)
int CPhidgetAdvancedServo_setPositionMax ( CPhidgetAdvancedServoHandle  phid,
int  index,
double  max 
)
int CPhidgetAdvancedServo_setPositionMin ( CPhidgetAdvancedServoHandle  phid,
int  index,
double  min 
)
int CPhidgetAdvancedServo_setServoParameters ( CPhidgetAdvancedServoHandle  phid,
int  index,
double  min_us,
double  max_us,
double  degrees,
double  velocity_max 
)
int CPhidgetAdvancedServo_setServoType ( CPhidgetAdvancedServoHandle  phid,
int  index,
CPhidget_ServoType  servoType 
)
int CPhidgetAdvancedServo_setSpeedRampingOn ( CPhidgetAdvancedServoHandle  phid,
int  index,
int  rampingState 
)
int CPhidgetAdvancedServo_setVelocityLimit ( CPhidgetAdvancedServoHandle  phid,
int  index,
double  limit 
)
int CPhidgetDictionary_addKey ( CPhidgetDictionaryHandle  dict,
const char *  key,
const char *  value,
int  persistent 
)
int CPhidgetDictionary_close ( CPhidgetDictionaryHandle  dict  ) 
int CPhidgetDictionary_create ( CPhidgetDictionaryHandle dict  ) 
int CPhidgetDictionary_delete ( CPhidgetDictionaryHandle  dict  ) 
int CPhidgetDictionary_getKey ( CPhidgetDictionaryHandle  dict,
const char *  key,
char *  value,
int  valuelen 
)
int CPhidgetDictionary_getServerAddress ( CPhidgetDictionaryHandle  dict,
const char **  address,
int *  port 
)
int CPhidgetDictionary_getServerID ( CPhidgetDictionaryHandle  dict,
const char **  serverID 
)
int CPhidgetDictionary_getServerStatus ( CPhidgetDictionaryHandle  dict,
int *  serverStatus 
)
int CPhidgetDictionary_openRemote ( CPhidgetDictionaryHandle  dict,
const char *  serverID,
const char *  password 
)
int CPhidgetDictionary_openRemoteIP ( CPhidgetDictionaryHandle  dict,
const char *  address,
int  port,
const char *  password 
)
int CPhidgetDictionary_remove_OnKeyChange_Handler ( CPhidgetDictionaryListenerHandle  dictlistener  ) 
int CPhidgetDictionary_removeKey ( CPhidgetDictionaryHandle  dict,
const char *  pattern 
)
int CPhidgetDictionary_set_OnError_Handler ( CPhidgetDictionaryHandle  dict,
int(*)(CPhidgetDictionaryHandle, void *userPtr, int errorCode, const char *errorString)  fptr,
void *  userPtr 
)
int CPhidgetDictionary_set_OnKeyChange_Handler ( CPhidgetDictionaryHandle  dict,
CPhidgetDictionaryListenerHandle dictlistener,
const char *  pattern,
CPhidgetDictionary_OnKeyChange_Function  fptr,
void *  userPtr 
)
int CPhidgetDictionary_set_OnServerConnect_Handler ( CPhidgetDictionaryHandle  dict,
int(*)(CPhidgetDictionaryHandle dict, void *userPtr)  fptr,
void *  userPtr 
)
int CPhidgetDictionary_set_OnServerDisconnect_Handler ( CPhidgetDictionaryHandle  dict,
int(*)(CPhidgetDictionaryHandle dict, void *userPtr)  fptr,
void *  userPtr 
)
int CPhidgetEncoder_create ( CPhidgetEncoderHandle phid  ) 
int CPhidgetEncoder_getEnabled ( CPhidgetEncoderHandle  phid,
int  index,
int *  enabledState 
)
int CPhidgetEncoder_getEncoderCount ( CPhidgetEncoderHandle  phid,
int *  count 
)
int CPhidgetEncoder_getIndexPosition ( CPhidgetEncoderHandle  phid,
int  index,
int *  position 
)
int CPhidgetEncoder_getInputCount ( CPhidgetEncoderHandle  phid,
int *  count 
)
int CPhidgetEncoder_getInputState ( CPhidgetEncoderHandle  phid,
int  index,
int *  inputState 
)
int CPhidgetEncoder_getPosition ( CPhidgetEncoderHandle  phid,
int  index,
int *  position 
)
int CPhidgetEncoder_set_OnInputChange_Handler ( CPhidgetEncoderHandle  phid,
int(*)(CPhidgetEncoderHandle phid, void *userPtr, int index, int inputState)  fptr,
void *  userPtr 
)
int CPhidgetEncoder_set_OnPositionChange_Handler ( CPhidgetEncoderHandle  phid,
int(*)(CPhidgetEncoderHandle phid, void *userPtr, int index, int time, int positionChange)  fptr,
void *  userPtr 
)
int CPhidgetEncoder_setEnabled ( CPhidgetEncoderHandle  phid,
int  index,
int  enabledState 
)
int CPhidgetEncoder_setPosition ( CPhidgetEncoderHandle  phid,
int  index,
int  position 
)
int CPhidgetInterfaceKit_create ( CPhidgetInterfaceKitHandle phid  ) 
int CPhidgetInterfaceKit_getDataRate ( CPhidgetInterfaceKitHandle  phid,
int  index,
int *  milliseconds 
)
int CPhidgetInterfaceKit_getDataRateMax ( CPhidgetInterfaceKitHandle  phid,
int  index,
int *  max 
)
int CPhidgetInterfaceKit_getDataRateMin ( CPhidgetInterfaceKitHandle  phid,
int  index,
int *  min 
)
int CPhidgetInterfaceKit_getInputCount ( CPhidgetInterfaceKitHandle  phid,
int *  count 
)
int CPhidgetInterfaceKit_getInputState ( CPhidgetInterfaceKitHandle  phid,
int  index,
int *  inputState 
)
int CPhidgetInterfaceKit_getOutputCount ( CPhidgetInterfaceKitHandle  phid,
int *  count 
)
int CPhidgetInterfaceKit_getOutputState ( CPhidgetInterfaceKitHandle  phid,
int  index,
int *  outputState 
)
int CPhidgetInterfaceKit_getRatiometric ( CPhidgetInterfaceKitHandle  phid,
int *  ratiometric 
)
int CPhidgetInterfaceKit_getSensorChangeTrigger ( CPhidgetInterfaceKitHandle  phid,
int  index,
int *  trigger 
)
int CPhidgetInterfaceKit_getSensorCount ( CPhidgetInterfaceKitHandle  phid,
int *  count 
)
int CPhidgetInterfaceKit_getSensorRawValue ( CPhidgetInterfaceKitHandle  phid,
int  index,
int *  sensorRawValue 
)
int CPhidgetInterfaceKit_getSensorValue ( CPhidgetInterfaceKitHandle  phid,
int  index,
int *  sensorValue 
)
int CPhidgetInterfaceKit_set_OnInputChange_Handler ( CPhidgetInterfaceKitHandle  phid,
int(*)(CPhidgetInterfaceKitHandle phid, void *userPtr, int index, int inputState)  fptr,
void *  userPtr 
)
int CPhidgetInterfaceKit_set_OnOutputChange_Handler ( CPhidgetInterfaceKitHandle  phid,
int(*)(CPhidgetInterfaceKitHandle phid, void *userPtr, int index, int outputState)  fptr,
void *  userPtr 
)
int CPhidgetInterfaceKit_set_OnSensorChange_Handler ( CPhidgetInterfaceKitHandle  phid,
int(*)(CPhidgetInterfaceKitHandle phid, void *userPtr, int index, int sensorValue)  fptr,
void *  userPtr 
)
int CPhidgetInterfaceKit_setDataRate ( CPhidgetInterfaceKitHandle  phid,
int  index,
int  milliseconds 
)
int CPhidgetInterfaceKit_setOutputState ( CPhidgetInterfaceKitHandle  phid,
int  index,
int  outputState 
)
int CPhidgetInterfaceKit_setRatiometric ( CPhidgetInterfaceKitHandle  phid,
int  ratiometric 
)
int CPhidgetInterfaceKit_setSensorChangeTrigger ( CPhidgetInterfaceKitHandle  phid,
int  index,
int  trigger 
)
int CPhidgetIR_create ( CPhidgetIRHandle phid  ) 
int CPhidgetIR_getLastCode ( CPhidgetIRHandle  phid,
unsigned char *  data,
int *  dataLength,
int *  bitCount 
)
int CPhidgetIR_getLastLearnedCode ( CPhidgetIRHandle  phid,
unsigned char *  data,
int *  dataLength,
CPhidgetIR_CodeInfo codeInfo 
)
int CPhidgetIR_getRawData ( CPhidgetIRHandle  phid,
int *  data,
int *  dataLength 
)
int CPhidgetIR_set_OnCode_Handler ( CPhidgetIRHandle  phid,
int(*)(CPhidgetIRHandle phid, void *userPtr, unsigned char *data, int dataLength, int bitCount, int repeat)  fptr,
void *  userPtr 
)
int CPhidgetIR_set_OnLearn_Handler ( CPhidgetIRHandle  phid,
int(*)(CPhidgetIRHandle phid, void *userPtr, unsigned char *data, int dataLength, CPhidgetIR_CodeInfoHandle codeInfo)  fptr,
void *  userPtr 
)
int CPhidgetIR_set_OnRawData_Handler ( CPhidgetIRHandle  phid,
int(*)(CPhidgetIRHandle phid, void *userPtr, int *data, int dataLength)  fptr,
void *  userPtr 
)
int CPhidgetIR_Transmit ( CPhidgetIRHandle  phid,
unsigned char *  data,
CPhidgetIR_CodeInfoHandle  codeInfo 
)
int CPhidgetIR_TransmitRaw ( CPhidgetIRHandle  phid,
int *  data,
int  length,
int  carrierFrequency,
int  dutyCycle,
int  gap 
)
int CPhidgetIR_TransmitRepeat ( CPhidgetIRHandle  phid  ) 
int CPhidgetLED_create ( CPhidgetLEDHandle phid  ) 
int CPhidgetLED_getCurrentLimit ( CPhidgetLEDHandle  phid,
CPhidgetLED_CurrentLimit currentLimit 
)
int CPhidgetLED_getDiscreteLED ( CPhidgetLEDHandle  phid,
int  index,
int *  brightness 
)
int CPhidgetLED_getLEDCount ( CPhidgetLEDHandle  phid,
int *  count 
)
int CPhidgetLED_getVoltage ( CPhidgetLEDHandle  phid,
CPhidgetLED_Voltage voltage 
)
int CPhidgetLED_setCurrentLimit ( CPhidgetLEDHandle  phid,
CPhidgetLED_CurrentLimit  currentLimit 
)
int CPhidgetLED_setDiscreteLED ( CPhidgetLEDHandle  phid,
int  index,
int  brightness 
)
int CPhidgetLED_setVoltage ( CPhidgetLEDHandle  phid,
CPhidgetLED_Voltage  voltage 
)
int CPhidgetManager_close ( CPhidgetManagerHandle  phidm  ) 
int CPhidgetManager_create ( CPhidgetManagerHandle phidm  ) 
int CPhidgetManager_delete ( CPhidgetManagerHandle  phidm  ) 
int CPhidgetManager_freeAttachedDevicesArray ( CPhidgetHandle  phidArray[]  ) 
int CPhidgetManager_getAttachedDevices ( CPhidgetManagerHandle  phidm,
CPhidgetHandle phidArray[],
int *  count 
)
int CPhidgetManager_getServerAddress ( CPhidgetManagerHandle  phidm,
const char **  address,
int *  port 
)
int CPhidgetManager_getServerID ( CPhidgetManagerHandle  phidm,
const char **  serverID 
)
int CPhidgetManager_getServerStatus ( CPhidgetManagerHandle  phidm,
int *  serverStatus 
)
int CPhidgetManager_open ( CPhidgetManagerHandle  phidm  ) 
int CPhidgetManager_openRemote ( CPhidgetManagerHandle  phidm,
const char *  serverID,
const char *  password 
)
int CPhidgetManager_openRemoteIP ( CPhidgetManagerHandle  phidm,
const char *  address,
int  port,
const char *  password 
)
int CPhidgetManager_set_OnAttach_Handler ( CPhidgetManagerHandle  phidm,
int(*)(CPhidgetHandle phid, void *userPtr)  fptr,
void *  userPtr 
)
int CPhidgetManager_set_OnDetach_Handler ( CPhidgetManagerHandle  phidm,
int(*)(CPhidgetHandle phid, void *userPtr)  fptr,
void *  userPtr 
)
int CPhidgetManager_set_OnError_Handler ( CPhidgetManagerHandle  phidm,
int(*)(CPhidgetManagerHandle phidm, void *userPtr, int errorCode, const char *errorString)  fptr,
void *  userPtr 
)
int CPhidgetManager_set_OnServerConnect_Handler ( CPhidgetManagerHandle  phidm,
int(*)(CPhidgetManagerHandle phidm, void *userPtr)  fptr,
void *  userPtr 
)
int CPhidgetManager_set_OnServerDisconnect_Handler ( CPhidgetManagerHandle  phidm,
int(*)(CPhidgetManagerHandle phidm, void *userPtr)  fptr,
void *  userPtr 
)
int CPhidgetMotorControl_create ( CPhidgetMotorControlHandle phid  ) 
int CPhidgetMotorControl_getAcceleration ( CPhidgetMotorControlHandle  phid,
int  index,
double *  acceleration 
)
int CPhidgetMotorControl_getAccelerationMax ( CPhidgetMotorControlHandle  phid,
int  index,
double *  max 
)
int CPhidgetMotorControl_getAccelerationMin ( CPhidgetMotorControlHandle  phid,
int  index,
double *  min 
)
int CPhidgetMotorControl_getCurrent ( CPhidgetMotorControlHandle  phid,
int  index,
double *  current 
)
int CPhidgetMotorControl_getInputCount ( CPhidgetMotorControlHandle  phid,
int *  count 
)
int CPhidgetMotorControl_getInputState ( CPhidgetMotorControlHandle  phid,
int  index,
int *  inputState 
)
int CPhidgetMotorControl_getMotorCount ( CPhidgetMotorControlHandle  phid,
int *  count 
)
int CPhidgetMotorControl_getVelocity ( CPhidgetMotorControlHandle  phid,
int  index,
double *  velocity 
)
int CPhidgetMotorControl_set_OnCurrentChange_Handler ( CPhidgetMotorControlHandle  phid,
int(*)(CPhidgetMotorControlHandle phid, void *userPtr, int index, double current)  fptr,
void *  userPtr 
)
int CPhidgetMotorControl_set_OnInputChange_Handler ( CPhidgetMotorControlHandle  phid,
int(*)(CPhidgetMotorControlHandle phid, void *userPtr, int index, int inputState)  fptr,
void *  userPtr 
)
int CPhidgetMotorControl_set_OnVelocityChange_Handler ( CPhidgetMotorControlHandle  phid,
int(*)(CPhidgetMotorControlHandle phid, void *userPtr, int index, double velocity)  fptr,
void *  userPtr 
)
int CPhidgetMotorControl_setAcceleration ( CPhidgetMotorControlHandle  phid,
int  index,
double  acceleration 
)
int CPhidgetMotorControl_setVelocity ( CPhidgetMotorControlHandle  phid,
int  index,
double  velocity 
)
int CPhidgetPHSensor_create ( CPhidgetPHSensorHandle phid  ) 
int CPhidgetPHSensor_getPH ( CPhidgetPHSensorHandle  phid,
double *  ph 
)
int CPhidgetPHSensor_getPHChangeTrigger ( CPhidgetPHSensorHandle  phid,
double *  trigger 
)
int CPhidgetPHSensor_getPHMax ( CPhidgetPHSensorHandle  phid,
double *  max 
)
int CPhidgetPHSensor_getPHMin ( CPhidgetPHSensorHandle  phid,
double *  min 
)
int CPhidgetPHSensor_getPotential ( CPhidgetPHSensorHandle  phid,
double *  potential 
)
int CPhidgetPHSensor_getPotentialMax ( CPhidgetPHSensorHandle  phid,
double *  max 
)
int CPhidgetPHSensor_getPotentialMin ( CPhidgetPHSensorHandle  phid,
double *  min 
)
int CPhidgetPHSensor_set_OnPHChange_Handler ( CPhidgetPHSensorHandle  phid,
int(*)(CPhidgetPHSensorHandle phid, void *userPtr, double ph)  fptr,
void *  userPtr 
)
int CPhidgetPHSensor_setPHChangeTrigger ( CPhidgetPHSensorHandle  phid,
double  trigger 
)
int CPhidgetPHSensor_setTemperature ( CPhidgetPHSensorHandle  phid,
double  temperature 
)
int CPhidgetRFID_create ( CPhidgetRFIDHandle phid  ) 
int CPhidgetRFID_getAntennaOn ( CPhidgetRFIDHandle  phid,
int *  antennaState 
)
int CPhidgetRFID_getLastTag ( CPhidgetRFIDHandle  phid,
unsigned char *  tag 
)
int CPhidgetRFID_getLEDOn ( CPhidgetRFIDHandle  phid,
int *  LEDState 
)
int CPhidgetRFID_getOutputCount ( CPhidgetRFIDHandle  phid,
int *  count 
)
int CPhidgetRFID_getOutputState ( CPhidgetRFIDHandle  phid,
int  index,
int *  outputState 
)
int CPhidgetRFID_getTagStatus ( CPhidgetRFIDHandle  phid,
int *  status 
)
int CPhidgetRFID_set_OnOutputChange_Handler ( CPhidgetRFIDHandle  phid,
int(*)(CPhidgetRFIDHandle phid, void *userPtr, int index, int outputState)  fptr,
void *  userPtr 
)
int CPhidgetRFID_set_OnTag_Handler ( CPhidgetRFIDHandle  phid,
int(*)(CPhidgetRFIDHandle phid, void *userPtr, unsigned char *tag)  fptr,
void *  userPtr 
)
int CPhidgetRFID_set_OnTagLost_Handler ( CPhidgetRFIDHandle  phid,
int(*)(CPhidgetRFIDHandle phid, void *userPtr, unsigned char *tag)  fptr,
void *  userPtr 
)
int CPhidgetRFID_setAntennaOn ( CPhidgetRFIDHandle  phid,
int  antennaState 
)
int CPhidgetRFID_setLEDOn ( CPhidgetRFIDHandle  phid,
int  LEDState 
)
int CPhidgetRFID_setOutputState ( CPhidgetRFIDHandle  phid,
int  index,
int  outputState 
)
int CPhidgetServo_create ( CPhidgetServoHandle phid  ) 
int CPhidgetServo_getEngaged ( CPhidgetServoHandle  phid,
int  index,
int *  engagedState 
)
int CPhidgetServo_getMotorCount ( CPhidgetServoHandle  phid,
int *  count 
)
int CPhidgetServo_getPosition ( CPhidgetServoHandle  phid,
int  index,
double *  position 
)
int CPhidgetServo_getPositionMax ( CPhidgetServoHandle  phid,
int  index,
double *  max 
)
int CPhidgetServo_getPositionMin ( CPhidgetServoHandle  phid,
int  index,
double *  min 
)
int CPhidgetServo_getServoType ( CPhidgetServoHandle  phid,
int  index,
CPhidget_ServoType servoType 
)
int CPhidgetServo_set_OnPositionChange_Handler ( CPhidgetServoHandle  phid,
int(*)(CPhidgetServoHandle phid, void *userPtr, int index, double position)  fptr,
void *  userPtr 
)
int CPhidgetServo_setEngaged ( CPhidgetServoHandle  phid,
int  index,
int  engagedState 
)
int CPhidgetServo_setPosition ( CPhidgetServoHandle  phid,
int  index,
double  position 
)
int CPhidgetServo_setServoParameters ( CPhidgetServoHandle  phid,
int  index,
double  min_us,
double  max_us,
double  degrees 
)
int CPhidgetServo_setServoType ( CPhidgetServoHandle  phid,
int  index,
CPhidget_ServoType  servoType 
)
int CPhidgetSpatial_create ( CPhidgetSpatialHandle phid  ) 
int CPhidgetSpatial_getAcceleration ( CPhidgetSpatialHandle  phid,
int  index,
double *  acceleration 
)
int CPhidgetSpatial_getAccelerationAxisCount ( CPhidgetSpatialHandle  phid,
int *  count 
)
int CPhidgetSpatial_getAccelerationMax ( CPhidgetSpatialHandle  phid,
int  index,
double *  max 
)
int CPhidgetSpatial_getAccelerationMin ( CPhidgetSpatialHandle  phid,
int  index,
double *  min 
)
int CPhidgetSpatial_getAngularRate ( CPhidgetSpatialHandle  phid,
int  index,
double *  angularRate 
)
int CPhidgetSpatial_getAngularRateMax ( CPhidgetSpatialHandle  phid,
int  index,
double *  max 
)
int CPhidgetSpatial_getAngularRateMin ( CPhidgetSpatialHandle  phid,
int  index,
double *  min 
)
int CPhidgetSpatial_getCompassAxisCount ( CPhidgetSpatialHandle  phid,
int *  count 
)
int CPhidgetSpatial_getDataRate ( CPhidgetSpatialHandle  phid,
int *  milliseconds 
)
int CPhidgetSpatial_getDataRateMax ( CPhidgetSpatialHandle  phid,
int *  max 
)
int CPhidgetSpatial_getDataRateMin ( CPhidgetSpatialHandle  phid,
int *  min 
)
int CPhidgetSpatial_getGyroAxisCount ( CPhidgetSpatialHandle  phid,
int *  count 
)
int CPhidgetSpatial_getMagneticField ( CPhidgetSpatialHandle  phid,
int  index,
double *  magneticField 
)
int CPhidgetSpatial_getMagneticFieldMax ( CPhidgetSpatialHandle  phid,
int  index,
double *  max 
)
int CPhidgetSpatial_getMagneticFieldMin ( CPhidgetSpatialHandle  phid,
int  index,
double *  min 
)
int CPhidgetSpatial_resetCompassCorrectionParameters ( CPhidgetSpatialHandle  phid  ) 
int CPhidgetSpatial_set_OnSpatialData_Handler ( CPhidgetSpatialHandle  phid,
int(*)(CPhidgetSpatialHandle phid, void *userPtr, CPhidgetSpatial_SpatialEventDataHandle *data, int dataCount)  fptr,
void *  userPtr 
)
int CPhidgetSpatial_setCompassCorrectionParameters ( CPhidgetSpatialHandle  phid,
double  magField,
double  offset0,
double  offset1,
double  offset2,
double  gain0,
double  gain1,
double  gain2,
double  T0,
double  T1,
double  T2,
double  T3,
double  T4,
double  T5 
)
int CPhidgetSpatial_setDataRate ( CPhidgetSpatialHandle  phid,
int  milliseconds 
)
int CPhidgetSpatial_zeroGyro ( CPhidgetSpatialHandle  phid  ) 
int CPhidgetStepper_create ( CPhidgetStepperHandle phid  ) 
int CPhidgetStepper_getAcceleration ( CPhidgetStepperHandle  phid,
int  index,
double *  acceleration 
)
int CPhidgetStepper_getAccelerationMax ( CPhidgetStepperHandle  phid,
int  index,
double *  max 
)
int CPhidgetStepper_getAccelerationMin ( CPhidgetStepperHandle  phid,
int  index,
double *  min 
)
int CPhidgetStepper_getCurrent ( CPhidgetStepperHandle  phid,
int  index,
double *  current 
)
int CPhidgetStepper_getCurrentLimit ( CPhidgetStepperHandle  phid,
int  index,
double *  limit 
)
int CPhidgetStepper_getCurrentMax ( CPhidgetStepperHandle  phid,
int  index,
double *  max 
)
int CPhidgetStepper_getCurrentMin ( CPhidgetStepperHandle  phid,
int  index,
double *  min 
)
int CPhidgetStepper_getCurrentPosition ( CPhidgetStepperHandle  phid,
int  index,
__int64 position 
)
int CPhidgetStepper_getEngaged ( CPhidgetStepperHandle  phid,
int  index,
int *  engagedState 
)
int CPhidgetStepper_getInputCount ( CPhidgetStepperHandle  phid,
int *  count 
)
int CPhidgetStepper_getInputState ( CPhidgetStepperHandle  phid,
int  index,
int *  inputState 
)
int CPhidgetStepper_getMotorCount ( CPhidgetStepperHandle  phid,
int *  count 
)
int CPhidgetStepper_getPositionMax ( CPhidgetStepperHandle  phid,
int  index,
__int64 max 
)
int CPhidgetStepper_getPositionMin ( CPhidgetStepperHandle  phid,
int  index,
__int64 min 
)
int CPhidgetStepper_getStopped ( CPhidgetStepperHandle  phid,
int  index,
int *  stoppedState 
)
int CPhidgetStepper_getTargetPosition ( CPhidgetStepperHandle  phid,
int  index,
__int64 position 
)
int CPhidgetStepper_getVelocity ( CPhidgetStepperHandle  phid,
int  index,
double *  velocity 
)
int CPhidgetStepper_getVelocityLimit ( CPhidgetStepperHandle  phid,
int  index,
double *  limit 
)
int CPhidgetStepper_getVelocityMax ( CPhidgetStepperHandle  phid,
int  index,
double *  max 
)
int CPhidgetStepper_getVelocityMin ( CPhidgetStepperHandle  phid,
int  index,
double *  min 
)
int CPhidgetStepper_set_OnCurrentChange_Handler ( CPhidgetStepperHandle  phid,
int(*)(CPhidgetStepperHandle phid, void *userPtr, int index, double current)  fptr,
void *  userPtr 
)
int CPhidgetStepper_set_OnInputChange_Handler ( CPhidgetStepperHandle  phid,
int(*)(CPhidgetStepperHandle phid, void *userPtr, int index, int inputState)  fptr,
void *  userPtr 
)
int CPhidgetStepper_set_OnPositionChange_Handler ( CPhidgetStepperHandle  phid,
int(*)(CPhidgetStepperHandle phid, void *userPtr, int index, __int64 position)  fptr,
void *  userPtr 
)
int CPhidgetStepper_set_OnVelocityChange_Handler ( CPhidgetStepperHandle  phid,
int(*)(CPhidgetStepperHandle phid, void *userPtr, int index, double velocity)  fptr,
void *  userPtr 
)
int CPhidgetStepper_setAcceleration ( CPhidgetStepperHandle  phid,
int  index,
double  acceleration 
)
int CPhidgetStepper_setCurrentLimit ( CPhidgetStepperHandle  phid,
int  index,
double  limit 
)
int CPhidgetStepper_setCurrentPosition ( CPhidgetStepperHandle  phid,
int  index,
__int64  position 
)
int CPhidgetStepper_setEngaged ( CPhidgetStepperHandle  phid,
int  index,
int  engagedState 
)
int CPhidgetStepper_setTargetPosition ( CPhidgetStepperHandle  phid,
int  index,
__int64  position 
)
int CPhidgetStepper_setVelocityLimit ( CPhidgetStepperHandle  phid,
int  index,
double  limit 
)
int CPhidgetTemperatureSensor_create ( CPhidgetTemperatureSensorHandle phid  ) 
int CPhidgetTemperatureSensor_getAmbientTemperature ( CPhidgetTemperatureSensorHandle  phid,
double *  ambient 
)
int CPhidgetTemperatureSensor_getAmbientTemperatureMax ( CPhidgetTemperatureSensorHandle  phid,
double *  max 
)
int CPhidgetTemperatureSensor_getAmbientTemperatureMin ( CPhidgetTemperatureSensorHandle  phid,
double *  min 
)
int CPhidgetTemperatureSensor_getPotential ( CPhidgetTemperatureSensorHandle  phid,
int  index,
double *  potential 
)
int CPhidgetTemperatureSensor_getPotentialMax ( CPhidgetTemperatureSensorHandle  phid,
int  index,
double *  max 
)
int CPhidgetTemperatureSensor_getPotentialMin ( CPhidgetTemperatureSensorHandle  phid,
int  index,
double *  min 
)
int CPhidgetTemperatureSensor_getTemperature ( CPhidgetTemperatureSensorHandle  phid,
int  index,
double *  temperature 
)
int CPhidgetTemperatureSensor_getTemperatureChangeTrigger ( CPhidgetTemperatureSensorHandle  phid,
int  index,
double *  trigger 
)
int CPhidgetTemperatureSensor_getTemperatureInputCount ( CPhidgetTemperatureSensorHandle  phid,
int *  count 
)
int CPhidgetTemperatureSensor_getTemperatureMax ( CPhidgetTemperatureSensorHandle  phid,
int  index,
double *  max 
)
int CPhidgetTemperatureSensor_getTemperatureMin ( CPhidgetTemperatureSensorHandle  phid,
int  index,
double *  min 
)
int CPhidgetTemperatureSensor_getThermocoupleType ( CPhidgetTemperatureSensorHandle  phid,
int  index,
CPhidgetTemperatureSensor_ThermocoupleType type 
)
int CPhidgetTemperatureSensor_set_OnTemperatureChange_Handler ( CPhidgetTemperatureSensorHandle  phid,
int(*)(CPhidgetTemperatureSensorHandle phid, void *userPtr, int index, double temperature)  fptr,
void *  userPtr 
)
int CPhidgetTemperatureSensor_setTemperatureChangeTrigger ( CPhidgetTemperatureSensorHandle  phid,
int  index,
double  trigger 
)
int CPhidgetTemperatureSensor_setThermocoupleType ( CPhidgetTemperatureSensorHandle  phid,
int  index,
CPhidgetTemperatureSensor_ThermocoupleType  type 
)
int CPhidgetTextLCD_create ( CPhidgetTextLCDHandle phid  ) 
int CPhidgetTextLCD_getBacklight ( CPhidgetTextLCDHandle  phid,
int *  backlightState 
)
int CPhidgetTextLCD_getBrightness ( CPhidgetTextLCDHandle  phid,
int *  brightness 
)
int CPhidgetTextLCD_getColumnCount ( CPhidgetTextLCDHandle  phid,
int *  count 
)
int CPhidgetTextLCD_getContrast ( CPhidgetTextLCDHandle  phid,
int *  contrast 
)
int CPhidgetTextLCD_getCursorBlink ( CPhidgetTextLCDHandle  phid,
int *  cursorBlinkState 
)
int CPhidgetTextLCD_getCursorOn ( CPhidgetTextLCDHandle  phid,
int *  cursorState 
)
int CPhidgetTextLCD_getRowCount ( CPhidgetTextLCDHandle  phid,
int *  count 
)
int CPhidgetTextLCD_setBacklight ( CPhidgetTextLCDHandle  phid,
int  backlightState 
)
int CPhidgetTextLCD_setBrightness ( CPhidgetTextLCDHandle  phid,
int  brightness 
)
int CPhidgetTextLCD_setContrast ( CPhidgetTextLCDHandle  phid,
int  contrast 
)
int CPhidgetTextLCD_setCursorBlink ( CPhidgetTextLCDHandle  phid,
int  cursorBlinkState 
)
int CPhidgetTextLCD_setCursorOn ( CPhidgetTextLCDHandle  phid,
int  cursorState 
)
int CPhidgetTextLCD_setCustomCharacter ( CPhidgetTextLCDHandle  phid,
int  index,
int  var1,
int  var2 
)
int CPhidgetTextLCD_setDisplayCharacter ( CPhidgetTextLCDHandle  phid,
int  index,
int  column,
unsigned char  character 
)
int CPhidgetTextLCD_setDisplayString ( CPhidgetTextLCDHandle  phid,
int  index,
char *  displayString 
)
int CPhidgetTextLED_create ( CPhidgetTextLEDHandle phid  ) 
int CPhidgetTextLED_getBrightness ( CPhidgetTextLEDHandle  phid,
int *  brightness 
)
int CPhidgetTextLED_getColumnCount ( CPhidgetTextLEDHandle  phid,
int *  count 
)
int CPhidgetTextLED_getRowCount ( CPhidgetTextLEDHandle  phid,
int *  count 
)
int CPhidgetTextLED_setBrightness ( CPhidgetTextLEDHandle  phid,
int  brightness 
)
int CPhidgetTextLED_setDisplayString ( CPhidgetTextLEDHandle  phid,
int  index,
char *  displayString 
)
int CPhidgetWeightSensor_create ( CPhidgetWeightSensorHandle phid  ) 
int CPhidgetWeightSensor_getWeight ( CPhidgetWeightSensorHandle  phid,
double *  weight 
)
int CPhidgetWeightSensor_getWeightChangeTrigger ( CPhidgetWeightSensorHandle  phid,
double *  trigger 
)
int CPhidgetWeightSensor_set_OnWeightChange_Handler ( CPhidgetWeightSensorHandle  phid,
int(*)(CPhidgetWeightSensorHandle phid, void *userPtr, double weight)  fptr,
void *  userPtr 
)
int CPhidgetWeightSensor_setWeightChangeTrigger ( CPhidgetWeightSensorHandle  phid,
double  trigger 
)
 All Classes Files Functions Variables Typedefs Enumerations Enumerator Defines


libphidgets
Author(s): Florian Weisshardt
autogenerated on Fri Jan 11 10:07:13 2013