Class Odometry

Class Documentation

class Odometry

Public Functions

explicit Odometry(size_t velocity_rolling_window_size = 10)
bool update(double left_vel, double right_vel, const rclcpp::Duration &dt)
void updateOpenLoop(double linear, double angular, const rclcpp::Duration &dt)
void resetOdometry()
inline double getX() const
inline double getY() const
inline double getHeading() const
inline double getLinear() const
inline double getAngular() const
void setWheelParams(double wheel_separation, double wheel_radius)
void setVelocityRollingWindowSize(size_t velocity_rolling_window_size)