#include <stdio.h>
#include <stdlib.h>
#include <getopt.h>
#include <map>
#include "ros/ros.h"
#include <execinfo.h>
#include <signal.h>
#include <sys/mman.h>
#include <sys/types.h>
#include <sys/stat.h>
#include <unistd.h>
#include <fcntl.h>
#include <pthread.h>
#include <boost/asio.hpp>
#include <boost/bind.hpp>
#include <boost/asio/io_service.hpp>
#include <open_controllers_interface/open_controllers_interface.h>
#include <std_srvs/Empty.h>
#include <boost/shared_ptr.hpp>
#include <boost/accumulators/accumulators.hpp>
#include <boost/accumulators/statistics/stats.hpp>
#include <boost/accumulators/statistics/max.hpp>
#include <boost/accumulators/statistics/mean.hpp>
#include <boost/thread.hpp>
#include <boost/filesystem.hpp>
#include <boost/pointer_cast.hpp>
#include <diagnostic_updater/DiagnosticStatusWrapper.h>
#include <pr2_controller_manager/controller_manager.h>
#include <diagnostic_msgs/DiagnosticArray.h>
#include <realtime_tools/realtime_publisher.h>
#include <std_msgs/Float64.h>
#include "utf8.h"
#include "b-Cap.h"
Go to the source code of this file.
Define Documentation
#define DEG2RAD |
( |
|
x | ) |
((x) * M_PI / 180.0) |
#define RAD2DEG |
( |
|
x | ) |
((x) * 180.0 / M_PI) |
Value:{ \
ROS_FATAL("fatal error has occurred"); \
quitRequest(); \
}
Definition at line 103 of file main.cpp.
Function Documentation
int main |
( |
int |
argc, |
|
|
char * |
argv[] |
|
) |
| |
Variable Documentation