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

Public Member Functions

void keyboardLoop ()
 
void stateCallback (const sensor_msgs::JointStateConstPtr &msg)
 
 TeleopJointsKeyboard ()
 
 ~TeleopJointsKeyboard ()
 

Private Attributes

std_msgs::Float64MultiArray cmd_
 
bool has_recieved_joints_
 
ros::Publisher joints_pub_
 
ros::Subscriber joints_sub_
 
ros::NodeHandle nh_
 

Detailed Description

Definition at line 85 of file keyboard_teleop.cpp.

Constructor & Destructor Documentation

◆ TeleopJointsKeyboard()

TeleopJointsKeyboard::TeleopJointsKeyboard ( )
inline

Definition at line 88 of file keyboard_teleop.cpp.

◆ ~TeleopJointsKeyboard()

TeleopJointsKeyboard::~TeleopJointsKeyboard ( )
inline

Definition at line 98 of file keyboard_teleop.cpp.

Member Function Documentation

◆ keyboardLoop()

void TeleopJointsKeyboard::keyboardLoop ( )
inline

Definition at line 122 of file keyboard_teleop.cpp.

◆ stateCallback()

void TeleopJointsKeyboard::stateCallback ( const sensor_msgs::JointStateConstPtr &  msg)
inline

Definition at line 102 of file keyboard_teleop.cpp.

Member Data Documentation

◆ cmd_

std_msgs::Float64MultiArray TeleopJointsKeyboard::cmd_
private

Definition at line 242 of file keyboard_teleop.cpp.

◆ has_recieved_joints_

bool TeleopJointsKeyboard::has_recieved_joints_
private

Definition at line 243 of file keyboard_teleop.cpp.

◆ joints_pub_

ros::Publisher TeleopJointsKeyboard::joints_pub_
private

Definition at line 240 of file keyboard_teleop.cpp.

◆ joints_sub_

ros::Subscriber TeleopJointsKeyboard::joints_sub_
private

Definition at line 241 of file keyboard_teleop.cpp.

◆ nh_

ros::NodeHandle TeleopJointsKeyboard::nh_
private

Definition at line 239 of file keyboard_teleop.cpp.


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


ros_control_boilerplate
Author(s): Dave Coleman
autogenerated on Mon Feb 28 2022 23:27:26