Public Member Functions | Private Attributes
lwr::ForceController Class Reference

#include <ForceController.h>

Inheritance diagram for lwr::ForceController:
Inheritance graph
[legend]

List of all members.

Public Member Functions

virtual void cleanupHook ()
virtual bool configureHook ()
 ForceController (const std::string &name)
virtual bool startHook ()
virtual void stopHook ()
virtual void updateHook ()
virtual ~ForceController ()

Private Attributes

geometry_msgs::Twist cartesian_twist
geometry_msgs::Wrench cartesian_wrench
double dt
OutputPort< geometry_msgs::Twist > port_cartesian_velocity_command
InputPort< geometry_msgs::Wrench > port_cartesian_wrench

Detailed Description

Definition at line 31 of file ForceController.h.


Constructor & Destructor Documentation

lwr::ForceController::ForceController ( const std::string &  name)

Definition at line 16 of file ForceController.cpp.

Definition at line 24 of file ForceController.cpp.


Member Function Documentation

Reimplemented from RTT::base::TaskCore.

Definition at line 32 of file ForceController.cpp.

Reimplemented from RTT::base::TaskCore.

Definition at line 28 of file ForceController.cpp.

bool lwr::ForceController::startHook ( ) [virtual]

Reimplemented from RTT::base::TaskCore.

Definition at line 36 of file ForceController.cpp.

void lwr::ForceController::stopHook ( ) [virtual]

Reimplemented from RTT::base::TaskCore.

Definition at line 40 of file ForceController.cpp.

Reimplemented from RTT::base::TaskCore.

Definition at line 44 of file ForceController.cpp.


Member Data Documentation

geometry_msgs::Twist lwr::ForceController::cartesian_twist [private]

Definition at line 49 of file ForceController.h.

geometry_msgs::Wrench lwr::ForceController::cartesian_wrench [private]

Definition at line 48 of file ForceController.h.

double lwr::ForceController::dt [private]

Definition at line 47 of file ForceController.h.

Definition at line 45 of file ForceController.h.

InputPort<geometry_msgs::Wrench> lwr::ForceController::port_cartesian_wrench [private]

Definition at line 44 of file ForceController.h.


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


lwr_impedance_controller
Author(s): Konrad Banachowicz
autogenerated on Mon Oct 6 2014 02:01:41