#include "Rmp440LE.h"
#include <sstream>
#include <nav_msgs/Odometry.h>
#include <sensor_msgs/Imu.h>
#include <tf/transform_datatypes.h>
#include <rmp_msgs/MotorStatus.h>
#include <rmp_msgs/Battery.h>
#include <RmpConfigurationCommand.h>
Go to the source code of this file.
Functions | |
static const std::string | LEFT_FRONT_WHEEL_JOINT_NAME ("left_front_wheel") |
static const std::string | LEFT_REAR_WHEEL_JOINT_NAME ("left_rear_wheel") |
static const std::string | RIGHT_FRONT_WHEEL_JOINT_NAME ("right_front_wheel") |
static const std::string | RIGHT_REAR_WHEEL_JOINT_NAME ("right_rear_wheel") |
Variables | |
static const double | DEADMAN_VALIDITY_PERIOD = 0.5 |
static const float | DEG_TO_RAD = 0.0174532925 |
static const double | G_TO_M_S2 = 9.80665 |
static const size_t | LEFT_FRONT_WHEEL_IDX = 0 |
static const size_t | LEFT_REAR_WHEEL_IDX = 2 |
static const double | MAX_UPDATE_PERIOD = 0.05 |
static const int | PORT_NUMBER_MAX = 65536 |
static const size_t | RIGHT_FRONT_WHEEL_IDX = 1 |
static const size_t | RIGHT_REAR_WHEEL_IDX = 3 |
static const double | UNKNOWN_COV = 99999.0 |
static const double | UPDATE_FREQUENCY_MAX = 100.0 |
static const double | UPDATE_FREQUENCY_MIN = 0.5 |
static const size_t | WHEEL_COUNT = 4 |
static const std::string LEFT_FRONT_WHEEL_JOINT_NAME | ( | "left_front_wheel" | ) | [static] |
static const std::string LEFT_REAR_WHEEL_JOINT_NAME | ( | "left_rear_wheel" | ) | [static] |
static const std::string RIGHT_FRONT_WHEEL_JOINT_NAME | ( | "right_front_wheel" | ) | [static] |
static const std::string RIGHT_REAR_WHEEL_JOINT_NAME | ( | "right_rear_wheel" | ) | [static] |
const double DEADMAN_VALIDITY_PERIOD = 0.5 [static] |
Definition at line 57 of file Rmp440LE.cpp.
const float DEG_TO_RAD = 0.0174532925 [static] |
Definition at line 56 of file Rmp440LE.cpp.
const double G_TO_M_S2 = 9.80665 [static] |
Definition at line 55 of file Rmp440LE.cpp.
const size_t LEFT_FRONT_WHEEL_IDX = 0 [static] |
Definition at line 65 of file Rmp440LE.cpp.
const size_t LEFT_REAR_WHEEL_IDX = 2 [static] |
Definition at line 67 of file Rmp440LE.cpp.
const double MAX_UPDATE_PERIOD = 0.05 [static] |
Definition at line 58 of file Rmp440LE.cpp.
const int PORT_NUMBER_MAX = 65536 [static] |
Definition at line 52 of file Rmp440LE.cpp.
const size_t RIGHT_FRONT_WHEEL_IDX = 1 [static] |
Definition at line 66 of file Rmp440LE.cpp.
const size_t RIGHT_REAR_WHEEL_IDX = 3 [static] |
Definition at line 68 of file Rmp440LE.cpp.
const double UNKNOWN_COV = 99999.0 [static] |
Definition at line 59 of file Rmp440LE.cpp.
const double UPDATE_FREQUENCY_MAX = 100.0 [static] |
Definition at line 54 of file Rmp440LE.cpp.
const double UPDATE_FREQUENCY_MIN = 0.5 [static] |
Definition at line 53 of file Rmp440LE.cpp.
const size_t WHEEL_COUNT = 4 [static] |
Definition at line 60 of file Rmp440LE.cpp.