#include <WheelControllerBase.h>
Classes | |
struct | Target |
Public Member Functions | |
bool | setup (ros::NodeHandle &root_nh, ros::NodeHandle &controller_nh) |
virtual void | starting (const ros::Time &time) |
virtual void | stopping (const ros::Time &time) |
void | updateCtrl (const ros::Time &time, const ros::Duration &period) |
Protected Member Functions | |
void | topicCallbackTwistCmd (const geometry_msgs::Twist::ConstPtr &msg) |
Protected Attributes | |
boost::scoped_ptr < realtime_tools::RealtimePublisher < cob_omni_drive_controller::WheelCommands > > | commands_pub_ |
uint32_t | cycles_ |
double | max_vel_rot_ |
double | max_vel_trans_ |
boost::mutex | mutex_ |
uint32_t | pub_divider_ |
struct cob_omni_drive_controller::WheelControllerBase::Target | target_ |
ros::Duration | timeout_ |
ros::Subscriber | twist_subscriber_ |
std::vector< WheelCommand > | wheel_commands_ |
Definition at line 39 of file WheelControllerBase.h.
bool cob_omni_drive_controller::WheelControllerBase< T >::setup | ( | ros::NodeHandle & | root_nh, |
ros::NodeHandle & | controller_nh | ||
) | [inline] |
Definition at line 42 of file WheelControllerBase.h.
virtual void cob_omni_drive_controller::WheelControllerBase< T >::starting | ( | const ros::Time & | time | ) | [inline, virtual] |
Definition at line 75 of file WheelControllerBase.h.
virtual void cob_omni_drive_controller::WheelControllerBase< T >::stopping | ( | const ros::Time & | time | ) | [inline, virtual] |
Definition at line 119 of file WheelControllerBase.h.
void cob_omni_drive_controller::WheelControllerBase< T >::topicCallbackTwistCmd | ( | const geometry_msgs::Twist::ConstPtr & | msg | ) | [inline, protected] |
Definition at line 140 of file WheelControllerBase.h.
void cob_omni_drive_controller::WheelControllerBase< T >::updateCtrl | ( | const ros::Time & | time, |
const ros::Duration & | period | ||
) | [inline] |
Definition at line 80 of file WheelControllerBase.h.
boost::scoped_ptr<realtime_tools::RealtimePublisher<cob_omni_drive_controller::WheelCommands> > cob_omni_drive_controller::WheelControllerBase< T >::commands_pub_ [protected] |
Definition at line 133 of file WheelControllerBase.h.
uint32_t cob_omni_drive_controller::WheelControllerBase< T >::cycles_ [protected] |
Definition at line 134 of file WheelControllerBase.h.
double cob_omni_drive_controller::WheelControllerBase< T >::max_vel_rot_ [protected] |
Definition at line 138 of file WheelControllerBase.h.
double cob_omni_drive_controller::WheelControllerBase< T >::max_vel_trans_ [protected] |
Definition at line 138 of file WheelControllerBase.h.
boost::mutex cob_omni_drive_controller::WheelControllerBase< T >::mutex_ [protected] |
Definition at line 130 of file WheelControllerBase.h.
uint32_t cob_omni_drive_controller::WheelControllerBase< T >::pub_divider_ [protected] |
Definition at line 135 of file WheelControllerBase.h.
struct cob_omni_drive_controller::WheelControllerBase::Target cob_omni_drive_controller::WheelControllerBase< T >::target_ [protected] |
ros::Duration cob_omni_drive_controller::WheelControllerBase< T >::timeout_ [protected] |
Definition at line 137 of file WheelControllerBase.h.
ros::Subscriber cob_omni_drive_controller::WheelControllerBase< T >::twist_subscriber_ [protected] |
Definition at line 131 of file WheelControllerBase.h.
std::vector<WheelCommand> cob_omni_drive_controller::WheelControllerBase< T >::wheel_commands_ [protected] |
Definition at line 128 of file WheelControllerBase.h.