#include <math.h>
#include <ros/ros.h>
#include <ros/time.h>
#include <std_msgs/Int32.h>
#include <sensor_msgs/Imu.h>
#include <sensor_msgs/JointState.h>
#include <geometry_msgs/Vector3.h>
#include <geometry_msgs/Twist.h>
#include <tf/tf.h>
#include <tf/transform_broadcaster.h>
#include <nav_msgs/Odometry.h>
#include <turtlebot3_msgs/SensorState.h>
#include "turtlebot3_fake.h"
Go to the source code of this file.
◆ DEG2RAD
| #define DEG2RAD |
( |
|
x | ) |
(x * 0.01745329252) |
◆ LEFT
◆ MAX_ANGULAR_VELOCITY
| #define MAX_ANGULAR_VELOCITY 2.84 |
◆ MAX_LINEAR_VELOCITY
| #define MAX_LINEAR_VELOCITY 0.22 |
◆ RAD2DEG
| #define RAD2DEG |
( |
|
x | ) |
(x * 57.2957795131) |
◆ RIGHT
◆ SCALE_VELOCITY_ANGULAR_Z
| #define SCALE_VELOCITY_ANGULAR_Z 1 |
◆ SCALE_VELOCITY_LINEAR_X
| #define SCALE_VELOCITY_LINEAR_X 1 |
◆ TORQUE_DISABLE
◆ TORQUE_ENABLE
◆ VELOCITY_ANGULAR_Z
| #define VELOCITY_ANGULAR_Z 0.1 |
◆ VELOCITY_LINEAR_X
| #define VELOCITY_LINEAR_X 0.01 |
◆ VELOCITY_STEP
| #define VELOCITY_STEP 0.01 |
◆ WHEEL_RADIUS
| #define WHEEL_RADIUS 0.033 |