#include <jockey.h>

Public Member Functions | |
| Jockey (const std::string &name, const double robot_radius) | |
| virtual void | onTraverse () |
Protected Member Functions | |
| void | initTwistHandlerParam (TwistHandler &twist_handler) |
Private Member Functions | |
| void | handleMap (const nav_msgs::OccupancyGridConstPtr &msg) |
Private Attributes | |
| TwistHandler | twist_handler_ |
| nj_oa_costmap::Jockey::Jockey | ( | const std::string & | name, |
| const double | robot_radius | ||
| ) |
Reimplemented from nj_oa_laser::Jockey.
Definition at line 6 of file jockey.cpp.
| void nj_oa_costmap::Jockey::handleMap | ( | const nav_msgs::OccupancyGridConstPtr & | msg | ) | [private] |
Definition at line 58 of file jockey.cpp.
| void nj_oa_costmap::Jockey::initTwistHandlerParam | ( | TwistHandler & | twist_handler | ) | [protected] |
Definition at line 13 of file jockey.cpp.
| void nj_oa_costmap::Jockey::onTraverse | ( | ) | [virtual] |
Reimplemented from nj_oa_laser::Jockey.
Definition at line 35 of file jockey.cpp.
Reimplemented from nj_oa_laser::Jockey.