#include <jockey.h>
Public Member Functions | |
void | initTwistHandlerParam (TwistHandler &twist_handler) |
Jockey (const std::string &name, const double robot_radius) | |
virtual void | onContinue () |
virtual void | onInterrupt () |
virtual void | onStop () |
virtual void | onTraverse () |
Protected Attributes | |
ros::Publisher | pub_twist_ |
Private Member Functions | |
void | handleLaser (const sensor_msgs::LaserScanConstPtr &msg) |
Private Attributes | |
TwistHandler | twist_handler_ |
To compute the twist from a LaserScan. |
nj_oa_laser::Jockey::Jockey | ( | const std::string & | name, |
const double | robot_radius | ||
) |
Definition at line 6 of file jockey.cpp.
void nj_oa_laser::Jockey::handleLaser | ( | const sensor_msgs::LaserScanConstPtr & | msg | ) | [private] |
Definition at line 76 of file jockey.cpp.
void nj_oa_laser::Jockey::initTwistHandlerParam | ( | TwistHandler & | twist_handler | ) |
Definition at line 13 of file jockey.cpp.
void nj_oa_laser::Jockey::onContinue | ( | ) | [virtual] |
Reimplemented from lama_jockeys::NavigatingJockey.
Definition at line 68 of file jockey.cpp.
void nj_oa_laser::Jockey::onInterrupt | ( | ) | [virtual] |
Reimplemented from lama_jockeys::NavigatingJockey.
Definition at line 62 of file jockey.cpp.
void nj_oa_laser::Jockey::onStop | ( | ) | [virtual] |
Implements lama_jockeys::NavigatingJockey.
Definition at line 54 of file jockey.cpp.
void nj_oa_laser::Jockey::onTraverse | ( | ) | [virtual] |
Implements lama_jockeys::NavigatingJockey.
Definition at line 28 of file jockey.cpp.
ros::Publisher nj_oa_laser::Jockey::pub_twist_ [protected] |