Public Types | Public Member Functions | Private Member Functions | Private Attributes
joint_qualification_controllers::HysteresisController Class Reference

Hystersis Controller. More...

#include <hysteresis_controller.h>

Inheritance diagram for joint_qualification_controllers::HysteresisController:
Inheritance graph
[legend]

List of all members.

Public Types

enum  {
  STOPPED, MOVING_HOME, MOVING_UP, MOVING_DOWN,
  ANALYZING, DONE
}

Public Member Functions

void analysis ()
 Perform the test analysis.
bool done ()
 HysteresisController ()
bool init (pr2_mechanism_model::RobotState *robot, ros::NodeHandle &n)
 Functional way to initialize.
bool sendData ()
 Sends data, returns true if sent.
void starting ()
 Called when controller is started.
void update ()
 Issues commands to the joint to perform hysteresis test.
 ~HysteresisController ()

Private Member Functions

bool turn ()

Private Attributes

bool complete
bool data_sent_
int down_count_
boost::scoped_ptr
< realtime_tools::RealtimePublisher
< joint_qualification_controllers::HysteresisData > > 
hyst_pub_
double initial_position_
ros::Time initial_time_
pr2_mechanism_model::JointStatejoint_
double last_publish_time_
double max_effort_
pr2_mechanism_model::RobotStaterobot_
int starting_count_
int state_
joint_qualification_controllers::HysteresisData test_data_
double timeout_
int up_count_
double velocity_
controller::JointVelocityControllervelocity_controller_

Detailed Description

Hystersis Controller.

This tests the hysteresis of a joint using a velocity controller.

Definition at line 60 of file hysteresis_controller.h.


Member Enumeration Documentation

anonymous enum
Enumerator:
STOPPED 
MOVING_HOME 
MOVING_UP 
MOVING_DOWN 
ANALYZING 
DONE 

Definition at line 64 of file hysteresis_controller.h.


Constructor & Destructor Documentation

Definition at line 48 of file hysteresis_controller.cpp.

Definition at line 92 of file hysteresis_controller.cpp.


Member Function Documentation

Perform the test analysis.

Definition at line 318 of file hysteresis_controller.cpp.

Definition at line 96 of file hysteresis_controller.h.

Functional way to initialize.

Parameters:
*robotThe robot that is being controlled.
&nNodeHandle of mechanism control

Implements pr2_controller_interface::Controller.

Definition at line 97 of file hysteresis_controller.cpp.

Sends data, returns true if sent.

Definition at line 339 of file hysteresis_controller.cpp.

void HysteresisController::starting ( ) [virtual]

Called when controller is started.

Reimplemented from pr2_controller_interface::Controller.

Definition at line 212 of file hysteresis_controller.cpp.

bool HysteresisController::turn ( ) [private]

Definition at line 301 of file hysteresis_controller.cpp.

void HysteresisController::update ( void  ) [virtual]

Issues commands to the joint to perform hysteresis test.

Implements pr2_controller_interface::Controller.

Definition at line 220 of file hysteresis_controller.cpp.


Member Data Documentation

Definition at line 110 of file hysteresis_controller.h.

Definition at line 117 of file hysteresis_controller.h.

Definition at line 109 of file hysteresis_controller.h.

Definition at line 122 of file hysteresis_controller.h.

Definition at line 108 of file hysteresis_controller.h.

Start time of the test.

Definition at line 107 of file hysteresis_controller.h.

Joint we're controlling.

Definition at line 102 of file hysteresis_controller.h.

Definition at line 119 of file hysteresis_controller.h.

Maximum allowable effort.

Definition at line 106 of file hysteresis_controller.h.

Pointer to robot structure.

Definition at line 103 of file hysteresis_controller.h.

Definition at line 115 of file hysteresis_controller.h.

Reimplemented from pr2_controller_interface::Controller.

Definition at line 114 of file hysteresis_controller.h.

Definition at line 100 of file hysteresis_controller.h.

Definition at line 112 of file hysteresis_controller.h.

Definition at line 109 of file hysteresis_controller.h.

Velocity during the test.

Definition at line 105 of file hysteresis_controller.h.

The velocity controller for the hysteresis test.

Definition at line 104 of file hysteresis_controller.h.


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


joint_qualification_controllers
Author(s): Kevin Watts, Melonee Wise
autogenerated on Tue Apr 22 2014 19:39:16