corobot_phidgetIK: corobot_phidgetIK
     this package is an interface to the device Phidget interface Kit 8/8/8 for CoroWare's robot Corobot. 
  
 
corobot_phidgetIK is ...
Services
The phidget node provides the following device services:
Topics
Input 
Output 
- infrared_data
- Message Type : corobot_msgs::IrMsg
 
- This topic sends every 200ms the voltage value of both infrared sensors. It also send the conversion in meters.
 
 
- bumper_data
- Message Type : corobot_msgs::BumperMsg
 
- This topic sends every 200ms information coming from the Bumper to tell if an obstacle has been hit or not.
 
 
- gripper_data
- Message Type : corobot_msgs::GrippergMsg
 
- This topic sends every 200ms information coming from the gripper.
 
 
- imu_data
- Message Type : sensor_msgs::Imu
 
- This topic sends every 200ms information coming from the imu.
 
 
- phidget_info
- Message Type : corobot_msgs::phidget_info
 
- This topic sends once at the creation of the node information related the initialization of the phidget device.
 
 
- sonar_data
- Message Type : corobot_msgs::RangeSensor
 
- This topic sends every 50ms the range in meters of every sonar sensors connected, if any.
 
 
codeapi