Classes | Functions | Variables
test_common.h File Reference
#include <algorithm>
#include <cmath>
#include <mutex>
#include <string>
#include <gtest/gtest.h>
#include <ros/ros.h>
#include <geometry_msgs/Twist.h>
#include <nav_msgs/Odometry.h>
#include <tf/tf.h>
#include <std_srvs/Empty.h>
#include <controller_manager_msgs/ListControllers.h>
Include dependency graph for test_common.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  AckermannSteeringControllerTest
 

Functions

tf::Quaternion tfQuatFromGeomQuat (const geometry_msgs::Quaternion &quat)
 

Variables

const double ANGULAR_VELOCITY_TOLERANCE = 0.05
 
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
 

Function Documentation

◆ tfQuatFromGeomQuat()

tf::Quaternion tfQuatFromGeomQuat ( const geometry_msgs::Quaternion &  quat)
inline

Definition at line 143 of file test_common.h.

Variable Documentation

◆ ANGULAR_VELOCITY_TOLERANCE

const double ANGULAR_VELOCITY_TOLERANCE = 0.05

Definition at line 54 of file test_common.h.

◆ EPS

const double EPS = 0.01
Author
Bence Magyar
Masaru Morita

Definition at line 51 of file test_common.h.

◆ JERK_ANGULAR_VELOCITY_TOLERANCE

const double JERK_ANGULAR_VELOCITY_TOLERANCE = 0.05

Definition at line 56 of file test_common.h.

◆ JERK_LINEAR_VELOCITY_TOLERANCE

const double JERK_LINEAR_VELOCITY_TOLERANCE = 0.10

Definition at line 55 of file test_common.h.

◆ ORIENTATION_TOLERANCE

const double ORIENTATION_TOLERANCE = 0.03

Definition at line 57 of file test_common.h.

◆ POSITION_TOLERANCE

const double POSITION_TOLERANCE = 0.01

Definition at line 52 of file test_common.h.

◆ VELOCITY_TOLERANCE

const double VELOCITY_TOLERANCE = 0.02

Definition at line 53 of file test_common.h.



ackermann_steering_controller
Author(s): Masaru Morita
autogenerated on Fri Feb 3 2023 03:19:04