Main robot control object. More...
#include <robot.h>
Public Member Functions | |
void | checkTF () |
void | reset_left () |
void | reset_right () |
robot () | |
Private Member Functions | |
void | move_arm_to_pose (float x, float y, float z, std::string frame, std::string group) |
Private Attributes | |
float | last_x |
float | last_y |
float | last_z |
actionlib::SimpleActionClient < arm_navigation_msgs::MoveArmAction > | move_l_arm |
actionlib::SimpleActionClient < arm_navigation_msgs::MoveArmAction > | move_r_arm |
ros::NodeHandle | node |
ros::Time | t |
tf::TransformListener | tfl |
Main robot control object.
The robot class controls the robot in response to the object recognition.
robot::robot | ( | ) |
void robot::checkTF | ( | ) |
void robot::move_arm_to_pose | ( | float | x, |
float | y, | ||
float | z, | ||
std::string | frame, | ||
std::string | group | ||
) | [private] |
void robot::reset_left | ( | ) |
void robot::reset_right | ( | ) |
float robot::last_x [private] |
float robot::last_y [private] |
float robot::last_z [private] |
ros::NodeHandle robot::node [private] |
tf::TransformListener robot::tfl [private] |