simple_robot_control::Base Class Reference

#include <base_control.h>

List of all members.

Public Member Functions

 Base ()
bool drive (double distance, const geometry_msgs::Twist &velocity)
bool driveBack (double distance, double speed=0.25)
bool driveForward (double distance, double speed=0.25)
bool driveLeft (double distance, double speed=0.25)
bool driveRight (double distance, double speed=0.25)
bool turn (bool clockwise, double radians, double speed=0.75)
virtual ~Base ()

Private Member Functions

void init ()

Private Attributes

geometry_msgs::Twist cmd_
ros::NodeHandle nh_
ros::Publisher pub_base_vel_
tf::TransformListener tf_listener_odom_

Static Private Attributes

static const double PUBLISH_RATE_ = 20.0

Detailed Description

Definition at line 54 of file base_control.h.


Constructor & Destructor Documentation

simple_robot_control::Base::Base (  ) 

Definition at line 19 of file base_control.cpp.

simple_robot_control::Base::~Base (  )  [virtual]

Definition at line 24 of file base_control.cpp.


Member Function Documentation

bool simple_robot_control::Base::drive ( double  distance,
const geometry_msgs::Twist &  velocity 
)

Definition at line 73 of file base_control.cpp.

bool simple_robot_control::Base::driveBack ( double  distance,
double  speed = 0.25 
)

Definition at line 55 of file base_control.cpp.

bool simple_robot_control::Base::driveForward ( double  distance,
double  speed = 0.25 
)

Definition at line 37 of file base_control.cpp.

bool simple_robot_control::Base::driveLeft ( double  distance,
double  speed = 0.25 
)

Definition at line 64 of file base_control.cpp.

bool simple_robot_control::Base::driveRight ( double  distance,
double  speed = 0.25 
)

Definition at line 46 of file base_control.cpp.

void simple_robot_control::Base::init (  )  [private]

Definition at line 27 of file base_control.cpp.

bool simple_robot_control::Base::turn ( bool  clockwise,
double  radians,
double  speed = 0.75 
)

Definition at line 117 of file base_control.cpp.


Member Data Documentation

geometry_msgs::Twist simple_robot_control::Base::cmd_ [private]

Definition at line 56 of file base_control.h.

ros::NodeHandle simple_robot_control::Base::nh_ [private]

Definition at line 54 of file base_control.h.

Definition at line 57 of file base_control.h.

const double simple_robot_control::Base::PUBLISH_RATE_ = 20.0 [static, private]

Definition at line 60 of file base_control.h.

tf::TransformListener simple_robot_control::Base::tf_listener_odom_ [private]

Definition at line 58 of file base_control.h.


The documentation for this class was generated from the following files:
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator Defines


simple_robot_control
Author(s): Christian Bersch, Sebastian Haug
autogenerated on Fri Jan 11 10:10:10 2013