#include <OdometryTracker.h>
|
const nav_msgs::Odometry & | getOdometry () |
|
void | init (const ros::Time &now) |
|
| OdometryTracker (const std::string &from="odom", const std::string &to="base_footprint", double cov_pose=0.1, double cov_twist=0.1) |
|
void | track (const ros::Time &now, double dt, double vel_x, double vel_y, double vel_theta) |
|
Definition at line 23 of file OdometryTracker.h.
OdometryTracker::OdometryTracker |
( |
const std::string & |
from = "odom" , |
|
|
const std::string & |
to = "base_footprint" , |
|
|
double |
cov_pose = 0.1 , |
|
|
double |
cov_twist = 0.1 |
|
) |
| |
|
inline |
const nav_msgs::Odometry& OdometryTracker::getOdometry |
( |
| ) |
|
|
inline |
void OdometryTracker::init |
( |
const ros::Time & |
now | ) |
|
|
inline |
void OdometryTracker::track |
( |
const ros::Time & |
now, |
|
|
double |
dt, |
|
|
double |
vel_x, |
|
|
double |
vel_y, |
|
|
double |
vel_theta |
|
) |
| |
|
inline |
nav_msgs::Odometry OdometryTracker::odom_ |
|
private |
double OdometryTracker::theta_rob_rad_ |
|
private |
The documentation for this class was generated from the following file: