#include <cmath>
#include <cstdlib>
#include <fstream>
#include "ros/ros.h"
#include "yaml-cpp/yaml.h"
#include "geometry_msgs/Vector3.h"
#include "nav_msgs/Odometry.h"
#include "sensor_msgs/Imu.h"
#include "sensor_msgs/JointState.h"
#include "std_srvs/Trigger.h"
#include "leo_msgs/Imu.h"
#include "leo_msgs/WheelOdom.h"
#include "leo_msgs/WheelOdomMecanum.h"
#include "leo_msgs/WheelStates.h"
#include "leo_msgs/SetImuCalibration.h"
Go to the source code of this file.
◆ get_calib_path()
std::string get_calib_path |
( |
| ) |
|
◆ imu_callback()
void imu_callback |
( |
const leo_msgs::ImuPtr & |
msg | ) |
|
◆ load_parameters()
◆ load_yaml_bias()
◆ main()
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
◆ mecanum_odom_callback()
void mecanum_odom_callback |
( |
const leo_msgs::WheelOdomMecanumPtr & |
msg | ) |
|
◆ merge_odometry_callback()
◆ reset_odometry_callback()
bool reset_odometry_callback |
( |
std_srvs::TriggerRequest & |
req, |
|
|
std_srvs::TriggerResponse & |
res |
|
) |
| |
◆ set_imu_calibration_callback()
bool set_imu_calibration_callback |
( |
leo_msgs::SetImuCalibrationRequest & |
req, |
|
|
leo_msgs::SetImuCalibrationResponse & |
res |
|
) |
| |
◆ wheel_odom_callback()
void wheel_odom_callback |
( |
const leo_msgs::WheelOdomPtr & |
msg | ) |
|
◆ wheel_states_callback()
void wheel_states_callback |
( |
const leo_msgs::WheelStatesPtr & |
msg | ) |
|
◆ calib_file_path
std::string calib_file_path = "" |
◆ imu_advertised
bool imu_advertised = false |
|
static |
◆ imu_angular_velocity_covariance_diagonal
std::vector<double> imu_angular_velocity_covariance_diagonal |
◆ imu_calibration_bias
std::vector<float> imu_calibration_bias = {0.0, 0.0, 0.0} |
◆ imu_frame_id
std::string imu_frame_id = "imu" |
◆ imu_linear_acceleration_covariance_diagonal
std::vector<double> imu_linear_acceleration_covariance_diagonal |
◆ imu_pub
◆ imu_sub
◆ joint_states_advertised
bool joint_states_advertised = false |
|
static |
◆ joint_states_pub
◆ odom_frame_id
std::string odom_frame_id = "odom" |
◆ odom_merged_advertised
bool odom_merged_advertised = false |
|
static |
◆ odom_merged_position
geometry_msgs::Point odom_merged_position |
|
static |
◆ odom_merged_pub
◆ odom_merged_timer
◆ odom_merged_yaw
◆ odom_reset_client
◆ PI
constexpr double PI = 3.141592653 |
|
constexpr |
◆ reset_odometry_service
◆ robot_frame_id
std::string robot_frame_id = "base_link" |
◆ set_imu_calibration_service
◆ tf_frame_prefix
std::string tf_frame_prefix = "" |
◆ velocity_angular_z
double velocity_angular_z = 0 |
|
static |
◆ velocity_linear_x
double velocity_linear_x = 0 |
|
static |
◆ velocity_linear_y
double velocity_linear_y = 0 |
|
static |
◆ wheel_joint_names
std::vector<std::string> wheel_joint_names |
◆ wheel_odom_advertised
bool wheel_odom_advertised = false |
|
static |
◆ wheel_odom_mecanum_advertised
bool wheel_odom_mecanum_advertised = false |
|
static |
◆ wheel_odom_mecanum_sub
◆ wheel_odom_mecanum_twist_covariance_diagonal
std::vector<double> wheel_odom_mecanum_twist_covariance_diagonal |
◆ wheel_odom_pub
◆ wheel_odom_sub
◆ wheel_odom_twist_covariance_diagonal
std::vector<double> wheel_odom_twist_covariance_diagonal |
◆ wheel_states_sub