#include "ros/ros.h"#include "geometry_msgs/Twist.h"#include "imcs01_driver/driver/urbtc.h"#include "imcs01_driver/driver/urobotc.h"#include <string>#include <mutex>#include <termios.h>

Go to the source code of this file.
Classes | |
| class | cirkit::ThirdRobotInterface |
Namespaces | |
| namespace | cirkit |
Enumerations | |
| enum | { FRONT, REAR } |
| enum | { ROBOT_STASIS_FORWARD, ROBOT_STASIS_FORWARD_STOP, ROBOT_STASIS_BACK, ROBOT_STASIS_BACK_STOP, ROBOT_STASIS_OTHERWISE } |
| enum | { FORWARD_MODE, FORWARD_STOP_MODE, BACK_MODE, BACK_STOP_MODE, STOP_MODE } |
Functions | |
| template<typename N , typename M > | |
| double | MAX (const N &a, const M &b) |
| template<typename N , typename M > | |
| double | MIN (const N &a, const M &b) |
| template<typename T > | |
| double | NORMALIZE (const T &z) |
| int | plus_or_minus (double value) |
| anonymous enum |
Definition at line 19 of file ThirdRobotInterface.h.
| anonymous enum |
| ROBOT_STASIS_FORWARD | |
| ROBOT_STASIS_FORWARD_STOP | |
| ROBOT_STASIS_BACK | |
| ROBOT_STASIS_BACK_STOP | |
| ROBOT_STASIS_OTHERWISE |
Definition at line 25 of file ThirdRobotInterface.h.
| anonymous enum |
Definition at line 34 of file ThirdRobotInterface.h.
| double MAX | ( | const N & | a, |
| const M & | b | ||
| ) | [inline] |
Definition at line 51 of file ThirdRobotInterface.h.
| double MIN | ( | const N & | a, |
| const M & | b | ||
| ) | [inline] |
Definition at line 45 of file ThirdRobotInterface.h.
Definition at line 57 of file ThirdRobotInterface.h.
| int plus_or_minus | ( | double | value | ) |