#include <cmath>
#include <gtest/gtest.h>
#include <ros/ros.h>
#include <geometry_msgs/TwistStamped.h>
#include <nav_msgs/Odometry.h>
#include <control_msgs/JointTrajectoryControllerState.h>
#include <tf/tf.h>
#include <std_srvs/Empty.h>
Go to the source code of this file.
◆ tfQuatFromGeomQuat()
tf::Quaternion tfQuatFromGeomQuat |
( |
const geometry_msgs::Quaternion & |
quat | ) |
|
|
inline |
◆ EPS
◆ JERK_ANGULAR_VELOCITY_TOLERANCE
const double JERK_ANGULAR_VELOCITY_TOLERANCE = 0.05 |
◆ JERK_LINEAR_VELOCITY_TOLERANCE
const double JERK_LINEAR_VELOCITY_TOLERANCE = 0.10 |
◆ ORIENTATION_TOLERANCE
const double ORIENTATION_TOLERANCE = 0.03 |
◆ POSITION_TOLERANCE
const double POSITION_TOLERANCE = 0.01 |
◆ VELOCITY_TOLERANCE
const double VELOCITY_TOLERANCE = 0.02 |