Functions | Variables
rq_sensor.cpp File Reference
#include <string.h>
#include <stdio.h>
#include "ros/ros.h"
#include "std_msgs/String.h"
#include "robotiq_force_torque_sensor/rq_sensor_state.h"
#include "robotiq_force_torque_sensor/ft_sensor.h"
#include "robotiq_force_torque_sensor/sensor_accessor.h"
Include dependency graph for rq_sensor.cpp:

Go to the source code of this file.

Functions

static void decode_message_and_do (INT_8 const *const buff, INT_8 *const ret)
 Decode the message received and do the associated action.
static
robotiq_force_torque_sensor::ft_sensor 
get_data (void)
 Builds the message with the force/torque data.
int main (int argc, char **argv)
bool receiverCallback (robotiq_force_torque_sensor::sensor_accessor::Request &req, robotiq_force_torque_sensor::sensor_accessor::Response &res)
static void wait_for_other_connection (void)
 Each second, checks for a sensor that has been connected.

Variables

ros::Publisher sensor_pub_acc

Detailed Description

Date:
July 14, 2014
Author:
Jonathan Savoie <jonathan.savoie@robotiq.com> Nicolas Lauzier <nicolas@robotiq.com>

Definition in file rq_sensor.cpp.


Function Documentation

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:
buffmessage to decode
retbuffer containing the return value from a GET command

Definition at line 62 of file rq_sensor.cpp.

void get_data ( void  ) [static]

Builds the message with the force/torque data.

Returns:
ft_sensor updated with the latest data

Definition at line 126 of file rq_sensor.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 140 of file rq_sensor.cpp.

bool receiverCallback ( robotiq_force_torque_sensor::sensor_accessor::Request &  req,
robotiq_force_torque_sensor::sensor_accessor::Response &  res 
)

Definition at line 89 of file rq_sensor.cpp.

static void wait_for_other_connection ( void  ) [static]

Each second, checks for a sensor that has been connected.

Definition at line 104 of file rq_sensor.cpp.


Variable Documentation

Definition at line 55 of file rq_sensor.cpp.



robotiq_force_torque_sensor
Author(s): Jonathan Savoie
autogenerated on Thu Aug 27 2015 14:44:30