12 #ifndef ECL_MOBILE_ROBOT_DIFFERENTIAL_DRIVE_KINEMATICS_HPP_
13 #define ECL_MOBILE_ROBOT_DIFFERENTIAL_DRIVE_KINEMATICS_HPP_
22 #include "../macros.hpp"
30 namespace mobile_robot {
72 DifferentialDriveKinematics(
73 const double &fixed_axis_length,
74 const double& wheel_radius) :
75 bias(fixed_axis_length),
114 ecl::LegacyPose2D<double> forwardWithPlatformVelocity(
const double & linearVelocity,
const double & angularVelocity )
const;
126 ecl::linear_algebra::Vector2d inverse(
const double &linear_velocity,
const double &angular_velocity)
const;
155 ECL_DEPRECATED static ecl::linear_algebra::Vector2d Inverse(
const ecl::linear_algebra::Vector3d &a,
const ecl::linear_algebra::Vector3d &b);