#include <bump_blink_controller.hpp>
Public Member Functions | |
BumpBlinkController (ros::NodeHandle &nh, std::string &name) | |
bool | init () |
~BumpBlinkController () | |
Public Member Functions inherited from yocs::Controller | |
Controller () | |
bool | disable () |
bool | enable () |
bool | getState () |
virtual void | spin () |
virtual | ~Controller () |
Private Member Functions | |
void | bumperEventCB (const kobuki_msgs::BumperEventConstPtr msg) |
Turns on/off a LED, when a bumper is pressed/released. More... | |
void | disableCB (const std_msgs::EmptyConstPtr msg) |
ROS logging output for disabling the controller. More... | |
void | enableCB (const std_msgs::EmptyConstPtr msg) |
ROS logging output for enabling the controller. More... | |
@ brief A simple bump-blink-controller
A simple nodelet-based controller for Kobuki, which makes one of Kobuki's LEDs blink, when a bumper is pressed.
Definition at line 65 of file bump_blink_controller.hpp.
|
inline |
Definition at line 68 of file bump_blink_controller.hpp.
|
inline |
Definition at line 69 of file bump_blink_controller.hpp.
|
private |
Turns on/off a LED, when a bumper is pressed/released.
msg | incoming topic message |
Definition at line 135 of file bump_blink_controller.hpp.
|
private |
ROS logging output for disabling the controller.
msg | incoming topic message |
Definition at line 123 of file bump_blink_controller.hpp.
|
private |
ROS logging output for enabling the controller.
msg | incoming topic message |
Definition at line 111 of file bump_blink_controller.hpp.
|
inlinevirtual |
Set-up necessary publishers/subscribers
Implements yocs::Controller.
Definition at line 75 of file bump_blink_controller.hpp.
|
private |
Definition at line 90 of file bump_blink_controller.hpp.
|
private |
Definition at line 89 of file bump_blink_controller.hpp.
|
private |
Definition at line 88 of file bump_blink_controller.hpp.
|
private |
Definition at line 88 of file bump_blink_controller.hpp.
|
private |
Definition at line 87 of file bump_blink_controller.hpp.
|
private |
Definition at line 83 of file bump_blink_controller.hpp.