main.cc File Reference
#include "FRIComm.hh"
#include "FRICheck.hh"
#include "YARPComm.hh"
#include "FRIData.hh"
#include <pthread.h>
#include <yarp/os/all.h>
#include <yarp/os/Bottle.h>
#include <yarp/os/BufferedPort.h>
#include <string>
#include <ros/ros.h>
#include <diagnostic_updater/diagnostic_updater.h>
#include <sensor_msgs/JointState.h>
#include <kuka_fri/ImpedanceCommand.h>
#include <soft_runstop/Handler.h>
#include <signal.h>
#include <string.h>
#include <time.h>
#include <sys/time.h>
#include <unistd.h>
Go to the source code of this file.
Function Documentation
void catchsignal |
( |
int |
signo |
) |
|
Ctrl-C handler.
Definition at line 18 of file main.cc.
bool friConfigure |
( |
const char * |
side, |
|
|
FRIThread * |
kuka, |
|
|
char * |
yarp_prefix | |
|
) |
| | |
int main |
( |
int |
argc, |
|
|
char ** |
argv | |
|
) |
| | |
Variable Documentation