#include <ros/ros.h>#include <sensor_msgs/JointState.h>#include <sensor_msgs/Imu.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"
Go to the source code of this file.
Classes | |
| class | RbcarControllerClass |
Defines | |
| #define | PI 3.1415926535 |
| #define | RBCAR_D_WHEELS_M 1.65 |
| #define | RBCAR_MAX_COMMAND_REC_FREQ 150.0 |
| #define | RBCAR_MIN_COMMAND_REC_FREQ 5.0 |
| #define | RBCAR_WHEEL_DIAMETER 0.470 |
Functions | |
| int | main (int argc, char **argv) |
| #define PI 3.1415926535 |
Definition at line 57 of file rbcar_robot_control.cpp.
| #define RBCAR_D_WHEELS_M 1.65 |
Definition at line 61 of file rbcar_robot_control.cpp.
| #define RBCAR_MAX_COMMAND_REC_FREQ 150.0 |
Definition at line 59 of file rbcar_robot_control.cpp.
| #define RBCAR_MIN_COMMAND_REC_FREQ 5.0 |
Definition at line 58 of file rbcar_robot_control.cpp.
| #define RBCAR_WHEEL_DIAMETER 0.470 |
Definition at line 62 of file rbcar_robot_control.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 630 of file rbcar_robot_control.cpp.