"Bump-Blink"-controller for the Kobuki controller tutorial More...
#include <ros/ros.h>
#include <std_msgs/Empty.h>
#include <yocs_controllers/default_controller.hpp>
#include <kobuki_msgs/BumperEvent.h>
#include <kobuki_msgs/Led.h>
Go to the source code of this file.
Classes | |
class | kobuki::BumpBlinkController |
Namespaces | |
namespace | kobuki |
"Bump-Blink"-controller for the Kobuki controller tutorial
A simple nodelet-based controller for Kobuki, which makes one of Kobuki's LEDs blink, when a bumper is pressed.
Definition in file bump_blink_controller.hpp.