Classes | Defines | Functions | Variables
main.cpp File Reference
#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"
Include dependency graph for main.cpp:

Go to the source code of this file.

Classes

class  DensoController
class  DensoController::DensoControllerStatus

Defines

#define BCAP_CONNECTION_UDP   1
#define CAST_STATUS(hr)   boost::static_pointer_cast<OpenControllersInterface::ControllerStatus>(DensoControllerStatusPtr(new DensoControllerStatus(hr)))
#define CLOCK_PRIO   0
#define CONTROL_PRIO   0
#define DEFAULT_SERVER_IP_ADDRESS   "133.11.216.196" /* Your controller IP address */
#define DEFAULT_SERVER_PORT_NUM   5007
#define DEFAULT_UDP_TIMEOUT   (10 * 1000)
#define DEG2RAD(x)   ((x) * M_PI / 180.0)
#define RAD2DEG(x)   ((x) * 180.0 / M_PI)
#define SAFE_EXIT(exit_code)
#define SAFE_OFFSET_DEG   1

Functions

int main (int argc, char *argv[])
void quitRequested (int sigint)

Variables

DensoController g_controller

Define Documentation

#define BCAP_CONNECTION_UDP   1

Definition at line 69 of file main.cpp.

#define CAST_STATUS (   hr)    boost::static_pointer_cast<OpenControllersInterface::ControllerStatus>(DensoControllerStatusPtr(new DensoControllerStatus(hr)))
#define CLOCK_PRIO   0

Definition at line 76 of file main.cpp.

#define CONTROL_PRIO   0

Definition at line 77 of file main.cpp.

#define DEFAULT_SERVER_IP_ADDRESS   "133.11.216.196" /* Your controller IP address */

Definition at line 73 of file main.cpp.

#define DEFAULT_SERVER_PORT_NUM   5007

Definition at line 74 of file main.cpp.

#define DEFAULT_UDP_TIMEOUT   (10 * 1000)

Definition at line 75 of file main.cpp.

#define DEG2RAD (   x)    ((x) * M_PI / 180.0)

Definition at line 80 of file main.cpp.

#define RAD2DEG (   x)    ((x) * 180.0 / M_PI)

Definition at line 79 of file main.cpp.

#define SAFE_EXIT (   exit_code)
Value:
{                  \
    ROS_FATAL("fatal error has occurred");      \
    quitRequest();              \
  }

Definition at line 103 of file main.cpp.

#define SAFE_OFFSET_DEG   1

Function Documentation

int main ( int  argc,
char *  argv[] 
)

Definition at line 1353 of file main.cpp.

void quitRequested ( int  sigint)

Definition at line 1346 of file main.cpp.


Variable Documentation

Definition at line 1345 of file main.cpp.



denso_controller
Author(s): Ryohei Ueda
autogenerated on Thu Jun 6 2019 20:15:20