#include <cmath>
#include <gtest/gtest.h>
#include <ros/ros.h>
#include <geometry_msgs/TwistStamped.h>
#include <nav_msgs/Odometry.h>
#include <tf/tf.h>
#include <std_srvs/Empty.h>
Go to the source code of this file.
Classes | |
class | DiffDriveControllerTest |
Functions | |
tf::Quaternion | tfQuatFromGeomQuat (const geometry_msgs::Quaternion &quat) |
Variables | |
const double | EPS = 0.01 |
const double | JERK_ANGULAR_VELOCITY_TOLERANCE = 0.05 |
const double | JERK_LINEAR_VELOCITY_TOLERANCE = 0.10 |
const double | ORIENTATION_TOLERANCE = 0.03 |
const double | POSITION_TOLERANCE = 0.01 |
const double | VELOCITY_TOLERANCE = 0.02 |
|
inline |
Definition at line 140 of file test_common.h.
const double EPS = 0.01 |
Definition at line 43 of file test_common.h.
const double JERK_ANGULAR_VELOCITY_TOLERANCE = 0.05 |
Definition at line 47 of file test_common.h.
const double JERK_LINEAR_VELOCITY_TOLERANCE = 0.10 |
Definition at line 46 of file test_common.h.
const double ORIENTATION_TOLERANCE = 0.03 |
Definition at line 48 of file test_common.h.
const double POSITION_TOLERANCE = 0.01 |
Definition at line 44 of file test_common.h.
const double VELOCITY_TOLERANCE = 0.02 |
Definition at line 45 of file test_common.h.