#include <string.h>
#include <stdio.h>
#include "ros/ros.h"
#include "std_msgs/String.h"
#include "geometry_msgs/WrenchStamped.h"
#include "robotiq_ft_sensor/rq_sensor_state.h"
#include "robotiq_ft_sensor/ft_sensor.h"
#include "robotiq_ft_sensor/sensor_accessor.h"
Go to the source code of this file.
|
typedef robotiq_ft_sensor::sensor_accessor::Request | Request |
|
typedef robotiq_ft_sensor::sensor_accessor::Request Request |
decode_message_and_do Decode the message received and do the associated action
- Parameters
-
req | request (of which the command_id is used) |
res | result with requested data |
- Returns
- true iff a valid command_id was given in the request
Definition at line 66 of file rq_sensor.cpp.
static void decode_message_and_do |
( |
INT_8 const *const |
buff, |
|
|
INT_8 *const |
ret |
|
) |
| |
|
static |
Decode the message received and do the associated action.
- Parameters
-
buff | message to decode |
ret | buffer containing the return value from a GET command |
Definition at line 92 of file rq_sensor.cpp.
Builds the message with the force/torque data.
- Returns
- ft_sensor updated with the latest data
Definition at line 178 of file rq_sensor.cpp.
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
static int max_retries_ |
( |
100 |
| ) |
|
|
static |
Support for old string-based interface
New interface with numerical commands
Definition at line 119 of file rq_sensor.cpp.
static INT_8 sensor_state_machine |
( |
| ) |
|
|
static |
static void wait_for_other_connection |
( |
| ) |
|
|
static |
Each second, checks for a sensor that has been connected.
Definition at line 153 of file rq_sensor.cpp.