Public Member Functions | |
void | lookAt (geometry_msgs::PoseStamped pose_stamped) |
void | lookAt (std::string frame_id, double x, double y, double z, double max_velocity=0.15, double max_wait_seconds=10.0) |
Points the high-def camera frame at a point in a given frame. | |
void | lookAt (std::string frame_id, double x, double y, double z, double max_wait_seconds=10.0) |
Points the high-def camera frame at a point in a given frame. | |
RobotHead () | |
Action client initialization. | |
RobotHead () | |
Action client initialization. | |
void | search_and_spin () |
Shake the head from left to right n times. | |
void | searchAndSpin (float step) |
Shake the head from left to right n times. | |
bool | switchActive (std_srvs::Empty::Request &req, std_srvs::Empty::Response &res) |
bool | switchInactive (std_srvs::Empty::Request &req, std_srvs::Empty::Response &res) |
void | track (geometry_msgs::PoseStamped ps) |
void | track (geometry_msgs::PoseStamped ps=geometry_msgs::PoseStamped()) |
~RobotHead () | |
~RobotHead () | |
Private Attributes | |
bool | active_ |
float | angle_range |
std::string | frame_to_point |
std::string | frame_to_track |
float | height_range |
ros::Time | last_pose |
tf::TransformListener | listener |
PointHeadClient * | point_head_client_ |
Definition at line 11 of file look_at_door_checkerboard.cpp.
RobotHead::RobotHead | ( | ) | [inline] |
Action client initialization.
Definition at line 22 of file look_at_door_checkerboard.cpp.
RobotHead::~RobotHead | ( | ) | [inline] |
Definition at line 33 of file look_at_door_checkerboard.cpp.
RobotHead::RobotHead | ( | ) | [inline] |
Action client initialization.
Definition at line 23 of file new_look.cpp.
RobotHead::~RobotHead | ( | ) | [inline] |
Definition at line 38 of file new_look.cpp.
void RobotHead::lookAt | ( | geometry_msgs::PoseStamped | pose_stamped | ) | [inline] |
Definition at line 38 of file look_at_door_checkerboard.cpp.
void RobotHead::lookAt | ( | std::string | frame_id, |
double | x, | ||
double | y, | ||
double | z, | ||
double | max_velocity = 0.15 , |
||
double | max_wait_seconds = 10.0 |
||
) | [inline] |
Points the high-def camera frame at a point in a given frame.
Definition at line 44 of file new_look.cpp.
void RobotHead::lookAt | ( | std::string | frame_id, |
double | x, | ||
double | y, | ||
double | z, | ||
double | max_wait_seconds = 10.0 |
||
) | [inline] |
Points the high-def camera frame at a point in a given frame.
Definition at line 60 of file look_at_door_checkerboard.cpp.
void RobotHead::search_and_spin | ( | ) | [inline] |
Shake the head from left to right n times.
Definition at line 121 of file new_look.cpp.
void RobotHead::searchAndSpin | ( | float | step | ) | [inline] |
Shake the head from left to right n times.
Definition at line 98 of file look_at_door_checkerboard.cpp.
bool RobotHead::switchActive | ( | std_srvs::Empty::Request & | req, |
std_srvs::Empty::Response & | res | ||
) | [inline] |
Definition at line 130 of file look_at_door_checkerboard.cpp.
bool RobotHead::switchInactive | ( | std_srvs::Empty::Request & | req, |
std_srvs::Empty::Response & | res | ||
) | [inline] |
Definition at line 138 of file look_at_door_checkerboard.cpp.
void RobotHead::track | ( | geometry_msgs::PoseStamped | ps | ) | [inline] |
Definition at line 77 of file new_look.cpp.
void RobotHead::track | ( | geometry_msgs::PoseStamped | ps = geometry_msgs::PoseStamped() | ) | [inline] |
Definition at line 92 of file look_at_door_checkerboard.cpp.
bool RobotHead::active_ [private] |
Definition at line 18 of file look_at_door_checkerboard.cpp.
float RobotHead::angle_range [private] |
Definition at line 18 of file new_look.cpp.
std::string RobotHead::frame_to_point [private] |
Definition at line 15 of file look_at_door_checkerboard.cpp.
std::string RobotHead::frame_to_track [private] |
Definition at line 16 of file look_at_door_checkerboard.cpp.
float RobotHead::height_range [private] |
Definition at line 19 of file new_look.cpp.
ros::Time RobotHead::last_pose [private] |
Definition at line 17 of file new_look.cpp.
tf::TransformListener RobotHead::listener [private] |
Definition at line 17 of file look_at_door_checkerboard.cpp.
PointHeadClient * RobotHead::point_head_client_ [private] |
Definition at line 14 of file look_at_door_checkerboard.cpp.