my_controller_ns::MyControllerClass Class Reference

#include <test_controller.h>

List of all members.

Public Member Functions

bool init (pr2_mechanism_model::RobotState *robot, ros::NodeHandle &n)
 Controller initialization in non-realtime.
void starting ()
 Controller startup in realtime.
void stopping ()
 Controller stopping in realtime.
void update ()
 Controller update loop in realtime.

Private Member Functions

bool serviceCallback (pr2_mechanism_msgs::LoadController::Request &req, pr2_mechanism_msgs::LoadController::Response &resp)
 Service call.

Private Attributes

pr2_mechanism_model::Chain chain_
unsigned int counter_
pr2_mechanism_model::JointState * joint_state_
KDL::Chain kdl_chain_
double max_effort_
boost::scoped_ptr
< realtime_tools::RealtimePublisher
< sensor_msgs::JointState > > 
pub_
pr2_mechanism_model::RobotState * robot_
ros::ServiceServer srv_
ros::Time time_of_last_cycle_

Detailed Description

Definition at line 14 of file test_controller.h.


Member Function Documentation

bool MyControllerClass::init ( pr2_mechanism_model::RobotState *  robot,
ros::NodeHandle &  n 
)

Controller initialization in non-realtime.

Definition at line 9 of file test_controller.cpp.

bool MyControllerClass::serviceCallback ( pr2_mechanism_msgs::LoadController::Request &  req,
pr2_mechanism_msgs::LoadController::Response &  resp 
) [private]

Service call.

Definition at line 122 of file test_controller.cpp.

void MyControllerClass::starting (  ) 

Controller startup in realtime.

Definition at line 86 of file test_controller.cpp.

void MyControllerClass::stopping (  ) 

Controller stopping in realtime.

Definition at line 117 of file test_controller.cpp.

void MyControllerClass::update (  ) 

Controller update loop in realtime.

Definition at line 94 of file test_controller.cpp.


Member Data Documentation

pr2_mechanism_model::Chain my_controller_ns::MyControllerClass::chain_ [private]

Definition at line 24 of file test_controller.h.

Definition at line 28 of file test_controller.h.

pr2_mechanism_model::JointState* my_controller_ns::MyControllerClass::joint_state_ [private]

Definition at line 23 of file test_controller.h.

Definition at line 25 of file test_controller.h.

Definition at line 27 of file test_controller.h.

boost::scoped_ptr<realtime_tools::RealtimePublisher<sensor_msgs::JointState> > my_controller_ns::MyControllerClass::pub_ [private]

Definition at line 21 of file test_controller.h.

pr2_mechanism_model::RobotState* my_controller_ns::MyControllerClass::robot_ [private]

Definition at line 22 of file test_controller.h.

ros::ServiceServer my_controller_ns::MyControllerClass::srv_ [private]

Definition at line 20 of file test_controller.h.

Definition at line 26 of file test_controller.h.


The documentation for this class was generated from the following files:
 All Classes Namespaces Files Functions Variables Typedefs


pr2_controller_manager
Author(s): Eric Berger berger@willowgarage.com, Stuart Glaser, Wim Meeussen
autogenerated on Fri Jan 11 09:41:10 2013