Public Member Functions | Private Attributes | List of all members
ArmTeleop Class Reference
Inheritance diagram for ArmTeleop:
Inheritance graph
[legend]

Public Member Functions

 ArmTeleop (const std::string &name, ros::NodeHandle &nh)
 
virtual void publish (const ros::Duration &dt)
 
virtual bool start ()
 
virtual bool stop ()
 
virtual bool update (const sensor_msgs::Joy::ConstPtr &joy, const sensor_msgs::JointState::ConstPtr &state)
 
- Public Member Functions inherited from TeleopComponent
 TeleopComponent ()
 
virtual ~TeleopComponent ()
 

Private Attributes

int axis_pitch_
 
int axis_roll_
 
int axis_x_
 
int axis_y_
 
int axis_yaw_
 
int axis_z_
 
int button_angular_
 
int button_linear_
 
ros::Publisher cmd_pub_
 
int deadman_
 
geometry_msgs::TwistStamped desired_
 
geometry_msgs::TwistStamped last_
 
ros::Time last_update_
 
double max_acc_pitch_
 
double max_acc_roll_
 
double max_acc_x_
 
double max_acc_y_
 
double max_acc_yaw_
 
double max_acc_z_
 
double max_vel_pitch_
 
double max_vel_roll_
 
double max_vel_x_
 
double max_vel_y_
 
double max_vel_yaw_
 
double max_vel_z_
 

Additional Inherited Members

- Protected Attributes inherited from TeleopComponent
bool active_
 

Detailed Description

Definition at line 569 of file joystick_teleop.cpp.

Constructor & Destructor Documentation

◆ ArmTeleop()

ArmTeleop::ArmTeleop ( const std::string &  name,
ros::NodeHandle nh 
)
inline

Definition at line 572 of file joystick_teleop.cpp.

Member Function Documentation

◆ publish()

virtual void ArmTeleop::publish ( const ros::Duration dt)
inlinevirtual

Implements TeleopComponent.

Definition at line 654 of file joystick_teleop.cpp.

◆ start()

virtual bool ArmTeleop::start ( )
inlinevirtual

Reimplemented from TeleopComponent.

Definition at line 673 of file joystick_teleop.cpp.

◆ stop()

virtual bool ArmTeleop::stop ( )
inlinevirtual

Reimplemented from TeleopComponent.

Definition at line 680 of file joystick_teleop.cpp.

◆ update()

virtual bool ArmTeleop::update ( const sensor_msgs::Joy::ConstPtr &  joy,
const sensor_msgs::JointState::ConstPtr &  state 
)
inlinevirtual

Implements TeleopComponent.

Definition at line 605 of file joystick_teleop.cpp.

Member Data Documentation

◆ axis_pitch_

int ArmTeleop::axis_pitch_
private

Definition at line 697 of file joystick_teleop.cpp.

◆ axis_roll_

int ArmTeleop::axis_roll_
private

Definition at line 697 of file joystick_teleop.cpp.

◆ axis_x_

int ArmTeleop::axis_x_
private

Definition at line 697 of file joystick_teleop.cpp.

◆ axis_y_

int ArmTeleop::axis_y_
private

Definition at line 697 of file joystick_teleop.cpp.

◆ axis_yaw_

int ArmTeleop::axis_yaw_
private

Definition at line 697 of file joystick_teleop.cpp.

◆ axis_z_

int ArmTeleop::axis_z_
private

Definition at line 697 of file joystick_teleop.cpp.

◆ button_angular_

int ArmTeleop::button_angular_
private

Definition at line 698 of file joystick_teleop.cpp.

◆ button_linear_

int ArmTeleop::button_linear_
private

Definition at line 698 of file joystick_teleop.cpp.

◆ cmd_pub_

ros::Publisher ArmTeleop::cmd_pub_
private

Definition at line 707 of file joystick_teleop.cpp.

◆ deadman_

int ArmTeleop::deadman_
private

Definition at line 696 of file joystick_teleop.cpp.

◆ desired_

geometry_msgs::TwistStamped ArmTeleop::desired_
private

Definition at line 709 of file joystick_teleop.cpp.

◆ last_

geometry_msgs::TwistStamped ArmTeleop::last_
private

Definition at line 710 of file joystick_teleop.cpp.

◆ last_update_

ros::Time ArmTeleop::last_update_
private

Definition at line 711 of file joystick_teleop.cpp.

◆ max_acc_pitch_

double ArmTeleop::max_acc_pitch_
private

Definition at line 704 of file joystick_teleop.cpp.

◆ max_acc_roll_

double ArmTeleop::max_acc_roll_
private

Definition at line 704 of file joystick_teleop.cpp.

◆ max_acc_x_

double ArmTeleop::max_acc_x_
private

Definition at line 703 of file joystick_teleop.cpp.

◆ max_acc_y_

double ArmTeleop::max_acc_y_
private

Definition at line 703 of file joystick_teleop.cpp.

◆ max_acc_yaw_

double ArmTeleop::max_acc_yaw_
private

Definition at line 704 of file joystick_teleop.cpp.

◆ max_acc_z_

double ArmTeleop::max_acc_z_
private

Definition at line 703 of file joystick_teleop.cpp.

◆ max_vel_pitch_

double ArmTeleop::max_vel_pitch_
private

Definition at line 702 of file joystick_teleop.cpp.

◆ max_vel_roll_

double ArmTeleop::max_vel_roll_
private

Definition at line 702 of file joystick_teleop.cpp.

◆ max_vel_x_

double ArmTeleop::max_vel_x_
private

Definition at line 701 of file joystick_teleop.cpp.

◆ max_vel_y_

double ArmTeleop::max_vel_y_
private

Definition at line 701 of file joystick_teleop.cpp.

◆ max_vel_yaw_

double ArmTeleop::max_vel_yaw_
private

Definition at line 702 of file joystick_teleop.cpp.

◆ max_vel_z_

double ArmTeleop::max_vel_z_
private

Definition at line 701 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