#include <ros/ros.h>#include <sensor_msgs/JointState.h>#include <sensor_msgs/Imu.h>#include <geometry_msgs/Twist.h>#include <std_msgs/Float64.h>#include <tf/transform_broadcaster.h>#include <nav_msgs/Odometry.h>#include <robotnik_msgs/set_mode.h>#include <robotnik_msgs/get_mode.h>#include <robotnik_msgs/set_odometry.h>#include <robotnik_msgs/ptz.h>#include "ackermann_msgs/AckermannDriveStamped.h"#include "diagnostic_msgs/DiagnosticStatus.h"#include "diagnostic_updater/diagnostic_updater.h"#include "diagnostic_updater/update_functions.h"#include "diagnostic_updater/DiagnosticStatusWrapper.h"#include "diagnostic_updater/publisher.h"#include <std_srvs/Empty.h>
Go to the source code of this file.
| Classes | |
| class | AGVSControllerClass | 
| Defines | |
| #define | AGVS_MAX_COMMAND_REC_FREQ 150.0 | 
| #define | AGVS_MIN_COMMAND_REC_FREQ 5.0 | 
| #define | AGVS_WHEEL_DIAMETER 0.2195 | 
| #define | DEFAULT_DIST_CENTER_TO_WHEEL 0.479 | 
| #define | MAX_ELEVATOR_POSITION 0.05 | 
| #define | PI 3.1415926535 | 
| Functions | |
| int | main (int argc, char **argv) | 
| #define AGVS_MAX_COMMAND_REC_FREQ 150.0 | 
Definition at line 59 of file agvs_robot_control.cpp.
| #define AGVS_MIN_COMMAND_REC_FREQ 5.0 | 
Definition at line 58 of file agvs_robot_control.cpp.
| #define AGVS_WHEEL_DIAMETER 0.2195 | 
Definition at line 61 of file agvs_robot_control.cpp.
| #define DEFAULT_DIST_CENTER_TO_WHEEL 0.479 | 
Definition at line 62 of file agvs_robot_control.cpp.
| #define MAX_ELEVATOR_POSITION 0.05 | 
Definition at line 64 of file agvs_robot_control.cpp.
| #define PI 3.1415926535 | 
Definition at line 57 of file agvs_robot_control.cpp.
| int main | ( | int | argc, | 
| char ** | argv | ||
| ) | 
Definition at line 642 of file agvs_robot_control.cpp.