simple_robot_control::Head Class Reference

#include <head_control.h>

List of all members.

Public Member Functions

 Head ()
bool lookat (const string source_frame, tf::Vector3 position=tf::Vector3(), double speed=DEFAULT_SPEED, string pointing_frame=DEFAULT_HEAD_POINTING_FRAME)
bool lookat (const string source_frame, double x, double y, double z, double speed=DEFAULT_SPEED, string pointing_frame=DEFAULT_HEAD_POINTING_FRAME)
bool lookat (const tf::StampedTransform pose, double speed=DEFAULT_SPEED, string pointing_frame=DEFAULT_HEAD_POINTING_FRAME)
bool lookat (const geometry_msgs::PoseStampedConstPtr pose, double speed=DEFAULT_SPEED, string pointing_frame=DEFAULT_HEAD_POINTING_FRAME)
 ~Head ()

Private Attributes

actionlib::SimpleActionClient
< pr2_controllers_msgs::PointHeadAction > * 
traj_client_

Static Private Attributes

static const double DEFAULT_SPEED = 1.0

Detailed Description

Definition at line 22 of file head_control.h.


Constructor & Destructor Documentation

simple_robot_control::Head::Head (  ) 

Definition at line 13 of file head_control.cpp.

simple_robot_control::Head::~Head (  ) 

Definition at line 20 of file head_control.cpp.


Member Function Documentation

bool simple_robot_control::Head::lookat ( const string  source_frame,
tf::Vector3  position = tf::Vector3(),
double  speed = DEFAULT_SPEED,
string  pointing_frame = DEFAULT_HEAD_POINTING_FRAME 
)

Definition at line 27 of file head_control.cpp.

bool simple_robot_control::Head::lookat ( const string  source_frame,
double  x,
double  y,
double  z,
double  speed = DEFAULT_SPEED,
string  pointing_frame = DEFAULT_HEAD_POINTING_FRAME 
)

Definition at line 65 of file head_control.cpp.

bool simple_robot_control::Head::lookat ( const tf::StampedTransform  pose,
double  speed = DEFAULT_SPEED,
string  pointing_frame = DEFAULT_HEAD_POINTING_FRAME 
)

Definition at line 71 of file head_control.cpp.

bool simple_robot_control::Head::lookat ( const geometry_msgs::PoseStampedConstPtr  pose,
double  speed = DEFAULT_SPEED,
string  pointing_frame = DEFAULT_HEAD_POINTING_FRAME 
)

Definition at line 57 of file head_control.cpp.


Member Data Documentation

const double simple_robot_control::Head::DEFAULT_SPEED = 1.0 [static, private]

Definition at line 26 of file head_control.h.

actionlib::SimpleActionClient< pr2_controllers_msgs::PointHeadAction>* simple_robot_control::Head::traj_client_ [private]

Definition at line 24 of file head_control.h.


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


simple_robot_control
Author(s): Christian Bersch, Sebastian Haug
autogenerated on Fri Jan 11 10:10:10 2013