@@ -56,7 +56,7 @@ class SteeringOdometry
5656 /* *
5757 * \brief Updates the odometry class with latest wheels position
5858 * \param traction_wheel_pos traction wheel position [rad]
59- * \param steer_pos Front Steer position [rad]
59+ * \param steer_pos Steer wheel position [rad]
6060 * \param dt time difference to last call
6161 * \return true if the odometry is actually updated
6262 */
@@ -67,7 +67,7 @@ class SteeringOdometry
6767 * \brief Updates the odometry class with latest wheels position
6868 * \param right_traction_wheel_pos Right traction wheel velocity [rad]
6969 * \param left_traction_wheel_pos Left traction wheel velocity [rad]
70- * \param front_steer_pos Steer wheel position [rad]
70+ * \param steer_pos Steer wheel position [rad]
7171 * \param dt time difference to last call
7272 * \return true if the odometry is actually updated
7373 */
@@ -91,7 +91,7 @@ class SteeringOdometry
9191 /* *
9292 * \brief Updates the odometry class with latest wheels position
9393 * \param traction_wheel_vel Traction wheel velocity [rad/s]
94- * \param front_steer_pos Steer wheel position [rad]
94+ * \param steer_pos Steer wheel position [rad]
9595 * \param dt time difference to last call
9696 * \return true if the odometry is actually updated
9797 */
@@ -102,7 +102,7 @@ class SteeringOdometry
102102 * \brief Updates the odometry class with latest wheels position
103103 * \param right_traction_wheel_vel Right traction wheel velocity [rad/s]
104104 * \param left_traction_wheel_vel Left traction wheel velocity [rad/s]
105- * \param front_steer_pos Steer wheel position [rad]
105+ * \param steer_pos Steer wheel position [rad]
106106 * \param dt time difference to last call
107107 * \return true if the odometry is actually updated
108108 */
@@ -125,11 +125,11 @@ class SteeringOdometry
125125
126126 /* *
127127 * \brief Updates the odometry class with latest velocity command
128- * \param linear Linear velocity [m/s]
129- * \param angular Angular velocity [rad/s]
130- * \param time Current time
128+ * \param v_bx Linear velocity [m/s]
129+ * \param omega_bz Angular velocity [rad/s]
130+ * \param dt time difference to last call
131131 */
132- void update_open_loop (const double linear , const double angular , const double dt);
132+ void update_open_loop (const double v_bx , const double omega_bz , const double dt);
133133
134134 /* *
135135 * \brief Set odometry type
@@ -170,22 +170,23 @@ class SteeringOdometry
170170 /* *
171171 * \brief Sets the wheel parameters: radius, separation and wheelbase
172172 */
173- void set_wheel_params (double wheel_radius, double wheelbase = 0.0 , double wheel_track = 0.0 );
173+ void set_wheel_params (
174+ const double wheel_radius, const double wheelbase = 0.0 , const double wheel_track = 0.0 );
174175
175176 /* *
176177 * \brief Velocity rolling window size setter
177178 * \param velocity_rolling_window_size Velocity rolling window size
178179 */
179- void set_velocity_rolling_window_size (size_t velocity_rolling_window_size);
180+ void set_velocity_rolling_window_size (const size_t velocity_rolling_window_size);
180181
181182 /* *
182183 * \brief Calculates inverse kinematics for the desired linear and angular velocities
183- * \param Vx Desired linear velocity [m/s]
184- * \param theta_dot Desired angular velocity [rad/s]
184+ * \param v_bx Desired linear velocity of the robot in x_b-axis direction
185+ * \param omega_bz Desired angular velocity of the robot around x_z-axis
185186 * \return Tuple of velocity commands and steering commands
186187 */
187188 std::tuple<std::vector<double >, std::vector<double >> get_commands (
188- const double Vx , const double theta_dot );
189+ const double v_bx , const double omega_bz );
189190
190191 /* *
191192 * \brief Reset poses, heading, and accumulators
@@ -194,35 +195,35 @@ class SteeringOdometry
194195
195196private:
196197 /* *
197- * \brief Uses precomputed linear and angular velocities to compute dometry and update
198- * accumulators \param linear Linear velocity [m] (linear displacement, i.e. m/s * dt)
199- * computed by previous odometry method \param angular Angular velocity [rad] (angular
200- * displacement, i.e. m/s * dt) computed by previous odometry method
198+ * \brief Uses precomputed linear and angular velocities to compute odometry
199+ * \param v_bx Linear velocity [m/s]
200+ * \param omega_bz Angular velocity [rad/s]
201+ * \param dt time difference to last call
201202 */
202- bool update_odometry (const double linear_velocity , const double angular , const double dt);
203+ bool update_odometry (const double v_bx , const double omega_bz , const double dt);
203204
204205 /* *
205206 * \brief Integrates the velocities (linear and angular) using 2nd order Runge-Kutta
206- * \param linear Linear velocity [m] (linear displacement, i.e. m/s * dt) computed by
207- * encoders \param angular Angular velocity [rad] (angular displacement, i.e. m/s * dt) computed
208- * by encoders
207+ * \param v_bx Linear velocity [m/s]
208+ * \param omega_bz Angular velocity [rad/s]
209+ * \param dt time difference to last call
209210 */
210- void integrate_runge_kutta_2 (double linear, double angular );
211+ void integrate_runge_kutta_2 (const double v_bx, const double omega_bz, const double dt );
211212
212213 /* *
213- * \brief Integrates the velocities (linear and angular) using exact method
214- * \param linear Linear velocity [m] (linear displacement, i.e. m/s * dt) computed by
215- * encoders \param angular Angular velocity [rad] (angular displacement, i.e. m/s * dt) computed
216- * by encoders
214+ * \brief Integrates the velocities (linear and angular)
215+ * \param v_bx Linear velocity [m/s]
216+ * \param omega_bz Angular velocity [rad/s]
217+ * \param dt time difference to last call
217218 */
218- void integrate_exact ( double linear, double angular );
219+ void integrate_fk ( const double v_bx, const double omega_bz, const double dt );
219220
220221 /* *
221- * \brief Calculates steering angle from the desired translational and rotational velocity
222- * \param Vx Linear velocity [m]
223- * \param theta_dot Angular velocity [rad]
222+ * \brief Calculates steering angle from the desired twist
223+ * \param v_bx Linear velocity of the robot in x_b-axis direction
224+ * \param omega_bz Angular velocity of the robot around x_z-axis
224225 */
225- double convert_trans_rot_vel_to_steering_angle ( double Vx, double theta_dot );
226+ double convert_twist_to_steering_angle ( const double v_bx, const double omega_bz );
226227
227228 /* *
228229 * \brief Reset linear and angular accumulators
0 commit comments