#include <ros/ros.h>
#include <sensor_msgs/Imu.h>
#include <geometry_msgs/Twist.h>
#include <nav_msgs/Odometry.h>
#include <geometry_msgs/Vector3Stamped.h>
Go to the source code of this file.
|
| bool | abslt (const double &val1, const double &val2) |
| |
| double | accumulator_update (const double &alpha, const double &avg, const double &meas) |
| |
| void | cmd_vel_callback (const geometry_msgs::TwistConstPtr &msg) |
| |
| void | imu_callback (const sensor_msgs::ImuConstPtr &msg) |
| |
| int | main (int argc, char **argv) |
| |
| void | odom_callback (const nav_msgs::OdometryConstPtr &msg) |
| |
◆ abslt()
| bool abslt |
( |
const double & |
val1, |
|
|
const double & |
val2 |
|
) |
| |
◆ accumulator_update()
| double accumulator_update |
( |
const double & |
alpha, |
|
|
const double & |
avg, |
|
|
const double & |
meas |
|
) |
| |
◆ cmd_vel_callback()
| void cmd_vel_callback |
( |
const geometry_msgs::TwistConstPtr & |
msg | ) |
|
◆ imu_callback()
| void imu_callback |
( |
const sensor_msgs::ImuConstPtr & |
msg | ) |
|
◆ main()
| int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
◆ odom_callback()
| void odom_callback |
( |
const nav_msgs::OdometryConstPtr & |
msg | ) |
|
◆ accumulator_alpha_
| double accumulator_alpha_ |
◆ angular_velocity_accumulator
| geometry_msgs::Vector3 angular_velocity_accumulator |
◆ bias_pub_
◆ cmd_vel_threshold_
| double cmd_vel_threshold_ |
◆ odom_is_zero_
◆ odom_threshold_
◆ pub_
◆ twist_is_zero_
◆ use_cmd_vel_
◆ use_odom_