Public Member Functions | Private Types | Private Attributes
GripperTeleop Class Reference
Inheritance diagram for GripperTeleop:
Inheritance graph
[legend]

List of all members.

Public Member Functions

 GripperTeleop (const std::string &name, ros::NodeHandle &nh)
virtual void publish (const ros::Duration &dt)
virtual bool update (const sensor_msgs::Joy::ConstPtr &joy, const sensor_msgs::JointState::ConstPtr &state)

Private Types

typedef
actionlib::SimpleActionClient
< control_msgs::GripperCommandAction > 
client_t

Private Attributes

boost::shared_ptr< client_tclient_
int close_button_
int deadman_
double max_effort_
double max_position_
double min_position_
int open_button_
bool req_close_
bool req_open_

Detailed Description

Definition at line 370 of file joystick_teleop.cpp.


Member Typedef Documentation

typedef actionlib::SimpleActionClient<control_msgs::GripperCommandAction> GripperTeleop::client_t [private]

Definition at line 372 of file joystick_teleop.cpp.


Constructor & Destructor Documentation

GripperTeleop::GripperTeleop ( const std::string &  name,
ros::NodeHandle nh 
) [inline]

Definition at line 375 of file joystick_teleop.cpp.


Member Function Documentation

virtual void GripperTeleop::publish ( const ros::Duration dt) [inline, virtual]

Implements TeleopComponent.

Definition at line 418 of file joystick_teleop.cpp.

virtual bool GripperTeleop::update ( const sensor_msgs::Joy::ConstPtr &  joy,
const sensor_msgs::JointState::ConstPtr &  state 
) [inline, virtual]

Implements TeleopComponent.

Definition at line 401 of file joystick_teleop.cpp.


Member Data Documentation

boost::shared_ptr<client_t> GripperTeleop::client_ [private]

Definition at line 442 of file joystick_teleop.cpp.

Definition at line 439 of file joystick_teleop.cpp.

int GripperTeleop::deadman_ [private]

Definition at line 439 of file joystick_teleop.cpp.

double GripperTeleop::max_effort_ [private]

Definition at line 440 of file joystick_teleop.cpp.

double GripperTeleop::max_position_ [private]

Definition at line 440 of file joystick_teleop.cpp.

double GripperTeleop::min_position_ [private]

Definition at line 440 of file joystick_teleop.cpp.

Definition at line 439 of file joystick_teleop.cpp.

bool GripperTeleop::req_close_ [private]

Definition at line 441 of file joystick_teleop.cpp.

bool GripperTeleop::req_open_ [private]

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