Classes | Public Member Functions | Public Attributes | Private Attributes | List of all members
diffbot::BaseController< TMotorController, TMotorDriver > Class Template Reference

Communicates with the high level hardware_interface::RobotHW and interacts with the robot hardware sensors (e.g. encoders) and actuators (e.g. motor driver). More...

#include <base_controller.h>

Classes

struct  LastUpdateTime
 Keeps track of the last update times. More...
 
struct  UpdateRate
 Stores update rate frequencies (Hz) for the main control loop, (optinal) imu and debug output. More...
 

Public Member Functions

 BaseController (ros::NodeHandle &nh, TMotorController *motor_controller_left, TMotorController *motor_controller_right)
 Construct a new Base Controller object using two generic motor controllers. More...
 
void commandCallback (const diffbot_msgs::WheelsCmdStamped &cmd_msg)
 Callback method when a new diffbot_msgs::WheelsCmdStamped is received on the wheel_cmd_velocities topic. More...
 
bool debug ()
 Getter if the firmware should log debug output. More...
 
void eStop ()
 Stops the motors, in case no wheel commands are received over a longer time period. More...
 
void init ()
 Reads parameters from the parameter server. More...
 
LastUpdateTimelastUpdateTime ()
 Returns a reference to last_update_times_. More...
 
int period (double frequency)
 Calculates the period (s) from a given frequency (Hz). More...
 
void pidLeftCallback (const diffbot_msgs::PIDStamped &pid_msg)
 Callback method to update the PID constants for the left motor. More...
 
void pidRightCallback (const diffbot_msgs::PIDStamped &pid_msg)
 Callback method to update the PID constants for the right motor. More...
 
void printDebug ()
 
UpdateRatepublishRate ()
 
void read ()
 Reads the current encoder tick counts and joint states (angular position (rad) and angular velocity (rad/s) from both encoders left encoder_left_ and right encoder_right_ and publishes sensor_msgs::JointState on the "measured_joint_states" topic, using the pub_measured_joint_states_. More...
 
void resetEncodersCallback (const std_msgs::Empty &reset_msg)
 Callback method to reset both encoder's tick count to zero. More...
 
void setup ()
 Initializes the main node handle and setup publisher and subscriber. More...
 
void write ()
 Uses the PIDs to compute capped PWM signals for the left and right motor. More...
 

Public Attributes

struct diffbot::BaseController::LastUpdateTime last_update_time_
 
struct diffbot::BaseController::UpdateRate update_rate_
 

Private Attributes

bool debug_
 
diffbot::Encoder encoder_left_
 
diffbot_msgs::EncodersStamped encoder_msg_
 
unsigned long encoder_resolution_
 
diffbot::Encoder encoder_right_
 
diffbot::JointState joint_state_left_
 
diffbot::JointState joint_state_right_
 
float max_angular_velocity_ = 0.0
 
float max_linear_velocity_ = 0.0
 
int motor_cmd_left_ = 0
 
int motor_cmd_right_ = 0
 
PID motor_pid_left_
 
PID motor_pid_right_
 
sensor_msgs::JointState msg_measured_joint_states_
 
ros::NodeHandlenh_
 
MotorControllerIntf< TMotorDriver > * p_motor_controller_left_
 
MotorControllerIntf< TMotorDriver > * p_motor_controller_right_
 
ros::Publisher pub_encoders_
 
ros::Publisher pub_measured_joint_states_
 
ros::Subscriber< diffbot_msgs::PIDStamped, BaseController< TMotorController, TMotorDriver > > sub_pid_left_
 
ros::Subscriber< diffbot_msgs::PIDStamped, BaseController< TMotorController, TMotorDriver > > sub_pid_right_
 
ros::Subscriber< std_msgs::Empty, BaseController< TMotorController, TMotorDriver > > sub_reset_encoders_
 
ros::Subscriber< diffbot_msgs::WheelsCmdStamped, BaseController< TMotorController, TMotorDriver > > sub_wheel_cmd_velocities_
 
long ticks_left_ = 0
 
long ticks_right_ = 0
 
float wheel_cmd_velocity_left_ = 0.0
 
float wheel_cmd_velocity_right_ = 0.0
 
float wheel_radius_ = 0.0
 

Detailed Description

template<typename TMotorController, typename TMotorDriver>
class diffbot::BaseController< TMotorController, TMotorDriver >

Communicates with the high level hardware_interface::RobotHW and interacts with the robot hardware sensors (e.g. encoders) and actuators (e.g. motor driver).

The BaseController communicates with the high level interface diffbot_base::hardware_interface::RobotHW using ROS publishers and subscribers. In the main loop (see main.cpp) this class is operated at specific update rates update_rate_ for different sensors and acutators. There exist three update rates:

The control update rate is used to read from the encoders and write computed pwm signals to the motors at a certain rate. This is important to avoid running into syncronization errors because of too many running calculations. Similarly the imu update rate reads the latest inertial measurements at a specific rate. To keep track when a new update is needed, the last_update_time_ member is used, which stores the time stamps when the last update happened. Additionally the LastUpdateTime::command_received time stamp is used to check for connection losses to the high level hardware interface, which would then stop the motors (see eStop), if no command message was received for a specified amount of time.

The BaseController subscribes to the target wheel command angular velocities (diffbot_msgs::WheelsCmdStamped on the "wheel_cmd_velocities" topic) with the sub_wheel_cmd_velocities_ and keeps pointers to both motors in p_motor_controller_right_ and p_motor_controller_left_ using a generic motor driver agnostic interface diffbot::MotorControllerIntf. Each time a new diffbot_msgs::WheelsCmdStamped is received on the "wheel_cmd_velocities" topic the commandCallback is called and the two target velocities wheel_cmd_velocity_left_ and wheel_cmd_velocity_right_ for each wheel are updated.

To measure the angular wheel positions (absolut) and the angular velocities, two diffbot::Encoder objects (encoder_left_ encoder_right_) are used to read() the diffbot::JointStates, stored in joint_state_left_ and joint_state_left_. After reading the latest states (position and velocity), the values are published with pub_measured_joint_states_ on "measured_joint_states" topic of type sensor_msgs::JointState. The diffbot_base::hardware_interface::RobotHW subscribes to these joint states and passes them on to the diff_drive_controller. Also inside the read() method, the current encoder ticks read from the encoder_left_ and encoder_right_ and stored in ticks_left_ and ticks_right_.

The measured angular velocities are important to compute the pwm signals for each motor using two separate PID controllers (motor_pid_left_ and motor_pid_right_), which calculate the error between measured and commanded angular wheel velocity for each wheel joint.

For initialization the following parameters are read from the ROS parameter server.

Template Parameters
TMotorController
TMotorDriver

Definition at line 77 of file base_controller.h.

Constructor & Destructor Documentation

◆ BaseController()

template<typename TMotorController , typename TMotorDriver >
diffbot::BaseController< TMotorController, TMotorDriver >::BaseController ( ros::NodeHandle nh,
TMotorController *  motor_controller_left,
TMotorController *  motor_controller_right 
)

Construct a new Base Controller object using two generic motor controllers.

Requires two initialized generic motor controllers, which are defined in a parent scope (e.g. main.cpp) The two motor controllers for the left and right motor are kept generic. The only requirement is to implement the diffbot::MotorControllerIntf, which is composed of the motor driver and has therefore the ability to control one motor.

Parameters
nhReference to the global ROS node handle
motor_controller_leftPointer to the generic motor controller for the left motor
motor_controller_rightPointer to the generic motor controller for the right motor

Definition at line 385 of file base_controller.h.

Member Function Documentation

◆ commandCallback()

template<typename TMotorController , typename TMotorDriver >
void diffbot::BaseController< TMotorController, TMotorDriver >::commandCallback ( const diffbot_msgs::WheelsCmdStamped cmd_msg)

Callback method when a new diffbot_msgs::WheelsCmdStamped is received on the wheel_cmd_velocities topic.

Callback method every time the angular wheel commands for each wheel joint are received from 'wheel_cmd_velocities' topic. This topic is published from the high level hardware_interface::RobotHW::write() method.

This callback method receives diffbot_msgs::WheelsCmdStamped message object (cmd_msg) consisting of diffbot_msgs::AngularVelocities, where commanded wheel joints for the left and right wheel are stored. After receiving the message the wheel_cmd_velocity_left_ and wheel_cmd_velocity_right_ members are updated, which are used in the next write() of the control loop.

wheel_cmd_velocity_left_ = cmd_msg.wheels_cmd.angular_velocities.joint[0];
wheel_cmd_velocity_right_ = cmd_msg.wheels_cmd.angular_velocities.joint[1];

In this method the lastUpdateTime::command_received time stamp is set to the current time. This is used for the eStop functionality. In case no diffbot_msgs::WheelsCmdStamped messages are received on the wheel_cmd_velocities topic, the eStop method is called (see main loop in main.cpp)

Parameters
cmd_msgMessage containing the commanded wheel velocities.

Definition at line 465 of file base_controller.h.

◆ debug()

template<typename TMotorController , typename TMotorDriver >
bool diffbot::BaseController< TMotorController, TMotorDriver >::debug ( )
inline

Getter if the firmware should log debug output.

Returns
true
false

Definition at line 211 of file base_controller.h.

◆ eStop()

template<typename TMotorController , typename TMotorDriver >
void diffbot::BaseController< TMotorController, TMotorDriver >::eStop

Stops the motors, in case no wheel commands are received over a longer time period.

Sets the wheel_cmd_velocity_left_ and wheel_cmd_velocity_right_ to zero. This method is called when the commandCallback wasn't called within the LastUpdateTime::command_received period on the /diffbot/wheel_cmd_velocities topic.

Definition at line 558 of file base_controller.h.

◆ init()

template<typename TMotorController , typename TMotorDriver >
void diffbot::BaseController< TMotorController, TMotorDriver >::init

Reads parameters from the parameter server.

  • Get Parameters from Parameter Server
    • /diffbot/encoder_resolution
    • /diffbot/mobile_base_controller/wheel_radius
    • /diffbot/mobile_base_controller/linear/x/max_velocity
    • /diffbot/debug/base_controller
  • Initialize DiffBot Wheel Encoders
  • Reset both wheel encoders tick count to zero
  • Initialize the max_angular_velocity_ from the read max_linear_velocity_ and wheel_radius_

Definition at line 435 of file base_controller.h.

◆ lastUpdateTime()

template<typename TMotorController , typename TMotorDriver >
LastUpdateTime& diffbot::BaseController< TMotorController, TMotorDriver >::lastUpdateTime ( )
inline

Returns a reference to last_update_times_.

Used inside the main loop inside main.cpp to compare with the current time if an update of a specific function (command_received, control, imu, debug) is needed.

Returns
LastUpdateTime& The pervious update times.

Definition at line 202 of file base_controller.h.

◆ period()

template<typename TMotorController , typename TMotorDriver >
int diffbot::BaseController< TMotorController, TMotorDriver >::period ( double  frequency)
inline

Calculates the period (s) from a given frequency (Hz).

Parameters
frequencyInput frequency (Hz) to be converted to period.
Returns
int period in seconds.

Definition at line 154 of file base_controller.h.

◆ pidLeftCallback()

template<typename TMotorController , typename TMotorDriver >
void diffbot::BaseController< TMotorController, TMotorDriver >::pidLeftCallback ( const diffbot_msgs::PIDStamped pid_msg)

Callback method to update the PID constants for the left motor.

Publish to pid_left topic to update the PID constants of the left motor.

Parameters
pid_msgmessage containing the new PID constants

Definition at line 490 of file base_controller.h.

◆ pidRightCallback()

template<typename TMotorController , typename TMotorDriver >
void diffbot::BaseController< TMotorController, TMotorDriver >::pidRightCallback ( const diffbot_msgs::PIDStamped pid_msg)

Callback method to update the PID constants for the right motor.

Publish to pid_right topic to update the PID constants of the right motor.

Parameters
pid_msgmessage containing the new PID constants

Definition at line 500 of file base_controller.h.

◆ printDebug()

template<typename TMotorController , typename TMotorDriver >
void diffbot::BaseController< TMotorController, TMotorDriver >::printDebug

Definition at line 565 of file base_controller.h.

◆ publishRate()

template<typename TMotorController , typename TMotorDriver >
UpdateRate& diffbot::BaseController< TMotorController, TMotorDriver >::publishRate ( )
inline

Definition at line 156 of file base_controller.h.

◆ read()

template<typename TMotorController , typename TMotorDriver >
void diffbot::BaseController< TMotorController, TMotorDriver >::read

Reads the current encoder tick counts and joint states (angular position (rad) and angular velocity (rad/s) from both encoders left encoder_left_ and right encoder_right_ and publishes sensor_msgs::JointState on the "measured_joint_states" topic, using the pub_measured_joint_states_.

Definition at line 511 of file base_controller.h.

◆ resetEncodersCallback()

template<typename TMotorController , typename TMotorDriver >
void diffbot::BaseController< TMotorController, TMotorDriver >::resetEncodersCallback ( const std_msgs::Empty &  reset_msg)

Callback method to reset both encoder's tick count to zero.

For initializing the the BaseController the encoder tick counts are set back to zero. Every time the diffbot_bringup/launch/bringup.launch is launched, the high level hardware_interface::RobotHW publishes an empty message on the /reset topic, which invokes this callback and sets the encoders to zero.

Parameters
reset_msgempty message (unused)

Definition at line 480 of file base_controller.h.

◆ setup()

template<typename TMotorController , typename TMotorDriver >
void diffbot::BaseController< TMotorController, TMotorDriver >::setup

Initializes the main node handle and setup publisher and subscriber.

Waits until the connection to the ros master is established.

Definition at line 406 of file base_controller.h.

◆ write()

template<typename TMotorController , typename TMotorDriver >
void diffbot::BaseController< TMotorController, TMotorDriver >::write

Uses the PIDs to compute capped PWM signals for the left and right motor.

The values for both motors sent to the motor driver are calculated by the two PIDs pid_motor_left_ and pid_motor_right_, based on the error between commanded angular velocity vs measured angular velocity (e.g. diffbot::PID::error_ = wheel_cmd_velocity_left_ - measured_angular_velocity_left_)

The calculated PID ouput values are capped at -/+ MAX_RPM to prevent the PID from having too much error The computed and capped PID values are then set using the diffbot::MotorControllerIntf::setSpeed method for the left and right motors p_motor_controller_left_ and p_motor_controller_right_.

Definition at line 536 of file base_controller.h.

Member Data Documentation

◆ debug_

template<typename TMotorController , typename TMotorDriver >
bool diffbot::BaseController< TMotorController, TMotorDriver >::debug_
private

Definition at line 373 of file base_controller.h.

◆ encoder_left_

template<typename TMotorController , typename TMotorDriver >
diffbot::Encoder diffbot::BaseController< TMotorController, TMotorDriver >::encoder_left_
private

Definition at line 338 of file base_controller.h.

◆ encoder_msg_

template<typename TMotorController , typename TMotorDriver >
diffbot_msgs::EncodersStamped diffbot::BaseController< TMotorController, TMotorDriver >::encoder_msg_
private

Definition at line 351 of file base_controller.h.

◆ encoder_resolution_

template<typename TMotorController , typename TMotorDriver >
unsigned long diffbot::BaseController< TMotorController, TMotorDriver >::encoder_resolution_
private

Definition at line 345 of file base_controller.h.

◆ encoder_right_

template<typename TMotorController , typename TMotorDriver >
diffbot::Encoder diffbot::BaseController< TMotorController, TMotorDriver >::encoder_right_
private

Definition at line 339 of file base_controller.h.

◆ joint_state_left_

template<typename TMotorController , typename TMotorDriver >
diffbot::JointState diffbot::BaseController< TMotorController, TMotorDriver >::joint_state_left_
private

Definition at line 343 of file base_controller.h.

◆ joint_state_right_

template<typename TMotorController , typename TMotorDriver >
diffbot::JointState diffbot::BaseController< TMotorController, TMotorDriver >::joint_state_right_
private

Definition at line 343 of file base_controller.h.

◆ last_update_time_

template<typename TMotorController , typename TMotorDriver >
struct diffbot::BaseController::LastUpdateTime diffbot::BaseController< TMotorController, TMotorDriver >::last_update_time_

◆ max_angular_velocity_

template<typename TMotorController , typename TMotorDriver >
float diffbot::BaseController< TMotorController, TMotorDriver >::max_angular_velocity_ = 0.0
private

Definition at line 330 of file base_controller.h.

◆ max_linear_velocity_

template<typename TMotorController , typename TMotorDriver >
float diffbot::BaseController< TMotorController, TMotorDriver >::max_linear_velocity_ = 0.0
private

Definition at line 329 of file base_controller.h.

◆ motor_cmd_left_

template<typename TMotorController , typename TMotorDriver >
int diffbot::BaseController< TMotorController, TMotorDriver >::motor_cmd_left_ = 0
private

Definition at line 364 of file base_controller.h.

◆ motor_cmd_right_

template<typename TMotorController , typename TMotorDriver >
int diffbot::BaseController< TMotorController, TMotorDriver >::motor_cmd_right_ = 0
private

Definition at line 365 of file base_controller.h.

◆ motor_pid_left_

template<typename TMotorController , typename TMotorDriver >
PID diffbot::BaseController< TMotorController, TMotorDriver >::motor_pid_left_
private

Definition at line 369 of file base_controller.h.

◆ motor_pid_right_

template<typename TMotorController , typename TMotorDriver >
PID diffbot::BaseController< TMotorController, TMotorDriver >::motor_pid_right_
private

Definition at line 370 of file base_controller.h.

◆ msg_measured_joint_states_

template<typename TMotorController , typename TMotorDriver >
sensor_msgs::JointState diffbot::BaseController< TMotorController, TMotorDriver >::msg_measured_joint_states_
private

Definition at line 354 of file base_controller.h.

◆ nh_

template<typename TMotorController , typename TMotorDriver >
ros::NodeHandle& diffbot::BaseController< TMotorController, TMotorDriver >::nh_
private

Definition at line 325 of file base_controller.h.

◆ p_motor_controller_left_

template<typename TMotorController , typename TMotorDriver >
MotorControllerIntf<TMotorDriver>* diffbot::BaseController< TMotorController, TMotorDriver >::p_motor_controller_left_
private

Definition at line 358 of file base_controller.h.

◆ p_motor_controller_right_

template<typename TMotorController , typename TMotorDriver >
MotorControllerIntf<TMotorDriver>* diffbot::BaseController< TMotorController, TMotorDriver >::p_motor_controller_right_
private

Definition at line 357 of file base_controller.h.

◆ pub_encoders_

template<typename TMotorController , typename TMotorDriver >
ros::Publisher diffbot::BaseController< TMotorController, TMotorDriver >::pub_encoders_
private

Definition at line 352 of file base_controller.h.

◆ pub_measured_joint_states_

template<typename TMotorController , typename TMotorDriver >
ros::Publisher diffbot::BaseController< TMotorController, TMotorDriver >::pub_measured_joint_states_
private

Definition at line 355 of file base_controller.h.

◆ sub_pid_left_

template<typename TMotorController , typename TMotorDriver >
ros::Subscriber<diffbot_msgs::PIDStamped, BaseController<TMotorController, TMotorDriver> > diffbot::BaseController< TMotorController, TMotorDriver >::sub_pid_left_
private

Definition at line 367 of file base_controller.h.

◆ sub_pid_right_

template<typename TMotorController , typename TMotorDriver >
ros::Subscriber<diffbot_msgs::PIDStamped, BaseController<TMotorController, TMotorDriver> > diffbot::BaseController< TMotorController, TMotorDriver >::sub_pid_right_
private

Definition at line 368 of file base_controller.h.

◆ sub_reset_encoders_

template<typename TMotorController , typename TMotorDriver >
ros::Subscriber<std_msgs::Empty, BaseController<TMotorController, TMotorDriver> > diffbot::BaseController< TMotorController, TMotorDriver >::sub_reset_encoders_
private

Definition at line 347 of file base_controller.h.

◆ sub_wheel_cmd_velocities_

template<typename TMotorController , typename TMotorDriver >
ros::Subscriber<diffbot_msgs::WheelsCmdStamped, BaseController<TMotorController, TMotorDriver> > diffbot::BaseController< TMotorController, TMotorDriver >::sub_wheel_cmd_velocities_
private

Definition at line 360 of file base_controller.h.

◆ ticks_left_

template<typename TMotorController , typename TMotorDriver >
long diffbot::BaseController< TMotorController, TMotorDriver >::ticks_left_ = 0
private

Definition at line 340 of file base_controller.h.

◆ ticks_right_

template<typename TMotorController , typename TMotorDriver >
long diffbot::BaseController< TMotorController, TMotorDriver >::ticks_right_ = 0
private

Definition at line 340 of file base_controller.h.

◆ update_rate_

template<typename TMotorController , typename TMotorDriver >
struct diffbot::BaseController::UpdateRate diffbot::BaseController< TMotorController, TMotorDriver >::update_rate_

◆ wheel_cmd_velocity_left_

template<typename TMotorController , typename TMotorDriver >
float diffbot::BaseController< TMotorController, TMotorDriver >::wheel_cmd_velocity_left_ = 0.0
private

Definition at line 361 of file base_controller.h.

◆ wheel_cmd_velocity_right_

template<typename TMotorController , typename TMotorDriver >
float diffbot::BaseController< TMotorController, TMotorDriver >::wheel_cmd_velocity_right_ = 0.0
private

Definition at line 362 of file base_controller.h.

◆ wheel_radius_

template<typename TMotorController , typename TMotorDriver >
float diffbot::BaseController< TMotorController, TMotorDriver >::wheel_radius_ = 0.0
private

Definition at line 328 of file base_controller.h.


The documentation for this class was generated from the following file:
diffbot::BaseController::wheel_cmd_velocity_left_
float wheel_cmd_velocity_left_
Definition: base_controller.h:361
diffbot::BaseController::wheel_cmd_velocity_right_
float wheel_cmd_velocity_right_
Definition: base_controller.h:362


diffbot_base
Author(s):
autogenerated on Thu Sep 7 2023 02:35:23