#include <ros/ros.h>#include <ros/console.h>#include <serial/serial.h>#include <signal.h>#include <string>#include <sstream>#include <geometry_msgs/Twist.h>#include <nav_msgs/Odometry.h>#include <tf/transform_broadcaster.h>#include <tf/tf.h>#include <geometry_msgs/Quaternion.h>#include <geometry_msgs/TransformStamped.h>#include <std_msgs/Float32.h>#include <roboteq_diff_msgs/Duplex.h>
Go to the source code of this file.
Classes | |
| class | MainNode |
Defines | |
| #define | _CMDVEL_DEBUG |
| #define | _ODOM_DEBUG |
| #define | _ODOM_SENSORS |
| #define | DELTAT(_nowtime, _thentime) ((_thentime>_nowtime)?((0xffffffff-_thentime)+_nowtime):(_nowtime-_thentime)) |
| #define | NORMALIZE(_z) atan2(sin(_z), cos(_z)) |
Functions | |
| int | main (int argc, char **argv) |
| uint32_t | millis () |
| void | mySigintHandler (int sig) |
| #define _CMDVEL_DEBUG |
Definition at line 17 of file driver.cpp.
| #define _ODOM_DEBUG |
Definition at line 29 of file driver.cpp.
| #define _ODOM_SENSORS |
Definition at line 32 of file driver.cpp.
| #define DELTAT | ( | _nowtime, | |
| _thentime | |||
| ) | ((_thentime>_nowtime)?((0xffffffff-_thentime)+_nowtime):(_nowtime-_thentime)) |
Definition at line 9 of file driver.cpp.
| #define NORMALIZE | ( | _z | ) | atan2(sin(_z), cos(_z)) |
Definition at line 37 of file driver.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 867 of file driver.cpp.
| uint32_t millis | ( | ) |
Definition at line 62 of file driver.cpp.
| void mySigintHandler | ( | int | sig | ) |
Definition at line 55 of file driver.cpp.