Public Member Functions | Private Types | Private Member Functions | Private Attributes
Teleop Class Reference

List of all members.

Public Member Functions

void init (ros::NodeHandle &nh)
void publish (const ros::Duration &dt)

Private Types

typedef boost::shared_ptr
< TeleopComponent
TeleopComponentPtr

Private Member Functions

void joyCallback (const sensor_msgs::Joy::ConstPtr &msg)
void stateCallback (const sensor_msgs::JointStateConstPtr &msg)

Private Attributes

std::vector< TeleopComponentPtrcomponents_
ros::Subscriber joy_sub_
ros::Time last_update_
sensor_msgs::JointStatePtr state_msg_
boost::mutex state_mutex_
ros::Subscriber state_sub_

Detailed Description

Definition at line 715 of file joystick_teleop.cpp.


Member Typedef Documentation

typedef boost::shared_ptr<TeleopComponent> Teleop::TeleopComponentPtr [private]

Definition at line 717 of file joystick_teleop.cpp.


Member Function Documentation

void Teleop::init ( ros::NodeHandle nh) [inline]

Definition at line 720 of file joystick_teleop.cpp.

void Teleop::joyCallback ( const sensor_msgs::Joy::ConstPtr &  msg) [inline, private]

Definition at line 800 of file joystick_teleop.cpp.

void Teleop::publish ( const ros::Duration dt) [inline]

Definition at line 780 of file joystick_teleop.cpp.

void Teleop::stateCallback ( const sensor_msgs::JointStateConstPtr &  msg) [inline, private]

Definition at line 821 of file joystick_teleop.cpp.


Member Data Documentation

std::vector<TeleopComponentPtr> Teleop::components_ [private]

Definition at line 849 of file joystick_teleop.cpp.

Definition at line 853 of file joystick_teleop.cpp.

Definition at line 850 of file joystick_teleop.cpp.

sensor_msgs::JointStatePtr Teleop::state_msg_ [private]

Definition at line 852 of file joystick_teleop.cpp.

boost::mutex Teleop::state_mutex_ [private]

Definition at line 851 of file joystick_teleop.cpp.

Definition at line 853 of file joystick_teleop.cpp.


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


fetch_teleop
Author(s): Michael Ferguson
autogenerated on Sat Apr 27 2019 03:12:18