Public Member Functions | Public Attributes | Private Member Functions | Private Attributes
controller::JointEffortController Class Reference

#include <joint_effort_controller.h>

Inheritance diagram for controller::JointEffortController:
Inheritance graph
[legend]

List of all members.

Public Member Functions

bool init (pr2_mechanism_model::RobotState *robot, const std::string &joint_name)
virtual bool init (pr2_mechanism_model::RobotState *robot, ros::NodeHandle &n)
 JointEffortController ()
virtual void starting ()
virtual void update ()
 ~JointEffortController ()

Public Attributes

double command_
pr2_mechanism_model::JointStatejoint_state_

Private Member Functions

void commandCB (const std_msgs::Float64ConstPtr &msg)

Private Attributes

ros::NodeHandle node_
pr2_mechanism_model::RobotStaterobot_
ros::Subscriber sub_command_

Detailed Description

Definition at line 64 of file joint_effort_controller.h.


Constructor & Destructor Documentation

Definition at line 42 of file joint_effort_controller.cpp.

Definition at line 47 of file joint_effort_controller.cpp.


Member Function Documentation

void controller::JointEffortController::commandCB ( const std_msgs::Float64ConstPtr &  msg) [private]

Definition at line 103 of file joint_effort_controller.cpp.

bool controller::JointEffortController::init ( pr2_mechanism_model::RobotState robot,
const std::string &  joint_name 
)

Definition at line 52 of file joint_effort_controller.cpp.

Implements pr2_controller_interface::Controller.

Definition at line 72 of file joint_effort_controller.cpp.

virtual void controller::JointEffortController::starting ( ) [inline, virtual]

Reimplemented from pr2_controller_interface::Controller.

Definition at line 74 of file joint_effort_controller.h.

void controller::JointEffortController::update ( void  ) [virtual]

Implements pr2_controller_interface::Controller.

Definition at line 98 of file joint_effort_controller.cpp.


Member Data Documentation

Definition at line 79 of file joint_effort_controller.h.

Definition at line 77 of file joint_effort_controller.h.

Definition at line 84 of file joint_effort_controller.h.

Definition at line 82 of file joint_effort_controller.h.

Definition at line 85 of file joint_effort_controller.h.


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


robot_mechanism_controllers
Author(s): John Hsu, Melonee Wise, Stuart Glaser
autogenerated on Fri Jan 3 2014 11:41:37