#include <jockey.h>

Public Member Functions | |
| void | handleLaser (const sensor_msgs::LaserScanConstPtr &msg) |
| Jockey (const std::string &name, const double frontier_width) | |
| virtual void | onContinue () |
| virtual void | onInterrupt () |
| virtual void | onStop () |
| virtual void | onTraverse () |
Private Attributes | |
| lama_msgs::Crossing | crossing_ |
| Crossing descriptor from LaserScan. | |
| crossing_detector::LaserCrossingDetector | crossing_detector_ |
| goto_crossing::CrossingGoer | crossing_goer_ |
| bool | has_crossing_ |
| ros::Subscriber | laserHandler_ |
| nj_oa_laser::TwistHandler | obstacle_avoider_ |
| Twist computation for obstacle avoidance. | |
| ros::Publisher | pub_crossing_ |
| ros::Publisher | pub_crossing_marker_ |
| ros::Publisher | pub_exits_marker_ |
| ros::Publisher | pub_place_profile_ |
| ros::Publisher | pub_twist_ |
| double | range_cutoff_ |
| sensor_msgs::LaserScan | scan_ |
| Last received laser scan. | |
| nj_laser::Jockey::Jockey | ( | const std::string & | name, |
| const double | frontier_width | ||
| ) |
Definition at line 6 of file jockey.cpp.
| void nj_laser::Jockey::handleLaser | ( | const sensor_msgs::LaserScanConstPtr & | msg | ) |
Definition at line 96 of file jockey.cpp.
| void nj_laser::Jockey::onContinue | ( | ) | [virtual] |
Reimplemented from lama_jockeys::NavigatingJockey.
Definition at line 90 of file jockey.cpp.
| void nj_laser::Jockey::onInterrupt | ( | ) | [virtual] |
Reimplemented from lama_jockeys::NavigatingJockey.
Definition at line 84 of file jockey.cpp.
| void nj_laser::Jockey::onStop | ( | ) | [virtual] |
Implements lama_jockeys::NavigatingJockey.
Definition at line 75 of file jockey.cpp.
| void nj_laser::Jockey::onTraverse | ( | ) | [virtual] |
Implements lama_jockeys::NavigatingJockey.
Definition at line 26 of file jockey.cpp.
lama_msgs::Crossing nj_laser::Jockey::crossing_ [private] |
bool nj_laser::Jockey::has_crossing_ [private] |
ros::Publisher nj_laser::Jockey::pub_twist_ [private] |
double nj_laser::Jockey::range_cutoff_ [private] |
sensor_msgs::LaserScan nj_laser::Jockey::scan_ [private] |