Public Member Functions | Private Member Functions | Private Attributes
teleop_controller Class Reference

Provides a bridge between the joy topic and the Rovio nodes. More...

#include <rovio_teleop.h>

List of all members.

Public Member Functions

 teleop_controller ()
 Creates a teleop_controller.

Private Member Functions

void joy_cback (const sensor_msgs::Joy::ConstPtr &joy)
 joy topic callback function.

Private Attributes

ros::Publisher cmd_vel
ros::ServiceClient head_ctrl
ros::Subscriber joy_sub
ros::NodeHandle node
std::string rovio_wav
ros::ServiceClient wav_play

Detailed Description

Provides a bridge between the joy topic and the Rovio nodes.

The teleop_controller handles the translation between joystick commands and communication to the Rovio nodes.

Definition at line 37 of file rovio_teleop.h.


Constructor & Destructor Documentation

Creates a teleop_controller.

Creates a teleop_controller object that can be used control the Rovio with a joystick. ROS nodes, services, and publishers are created and maintained within this object.

Definition at line 24 of file rovio_teleop.cpp.


Member Function Documentation

void teleop_controller::joy_cback ( const sensor_msgs::Joy::ConstPtr &  joy) [private]

joy topic callback function.

Process the joystick command and send messages/service requests to the appropriate Rovio nodes.

Parameters:
joythe message for the joy topic

Definition at line 44 of file rovio_teleop.cpp.


Member Data Documentation

the cmd_vel topic

Definition at line 59 of file rovio_teleop.h.

Definition at line 60 of file rovio_teleop.h.

the joy topic

Definition at line 61 of file rovio_teleop.h.

a handle for this ROS node

Definition at line 57 of file rovio_teleop.h.

std::string teleop_controller::rovio_wav [private]

the rovio_av wav directory location

Definition at line 63 of file rovio_teleop.h.

the head_ctrl and wav_play services

Definition at line 60 of file rovio_teleop.h.


The documentation for this class was generated from the following files:


rovio_ctrl
Author(s): Russell Toris
autogenerated on Mon Oct 6 2014 07:13:12