Public Member Functions | Private Types | Private Member Functions | Private Attributes | List of all members
Teleop Class Reference

Public Member Functions

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

Private Types

typedef boost::shared_ptr< TeleopComponentTeleopComponentPtr
 

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

◆ TeleopComponentPtr

Definition at line 717 of file joystick_teleop.cpp.

Member Function Documentation

◆ init()

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

Definition at line 720 of file joystick_teleop.cpp.

◆ joyCallback()

void Teleop::joyCallback ( const sensor_msgs::Joy::ConstPtr &  msg)
inlineprivate

Definition at line 800 of file joystick_teleop.cpp.

◆ publish()

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

Definition at line 780 of file joystick_teleop.cpp.

◆ stateCallback()

void Teleop::stateCallback ( const sensor_msgs::JointStateConstPtr &  msg)
inlineprivate

Definition at line 821 of file joystick_teleop.cpp.

Member Data Documentation

◆ components_

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

Definition at line 849 of file joystick_teleop.cpp.

◆ joy_sub_

ros::Subscriber Teleop::joy_sub_
private

Definition at line 853 of file joystick_teleop.cpp.

◆ last_update_

ros::Time Teleop::last_update_
private

Definition at line 850 of file joystick_teleop.cpp.

◆ state_msg_

sensor_msgs::JointStatePtr Teleop::state_msg_
private

Definition at line 852 of file joystick_teleop.cpp.

◆ state_mutex_

boost::mutex Teleop::state_mutex_
private

Definition at line 851 of file joystick_teleop.cpp.

◆ state_sub_

ros::Subscriber Teleop::state_sub_
private

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 Mon Feb 28 2022 22:24:06