#include <ias_drawer_executive/OperateHandleController.h>
#include <ias_drawer_executive/RobotArm.h>
#include <ias_drawer_executive/Geometry.h>
#include <ias_drawer_executive/Gripper.h>
#include <ias_drawer_executive/Perception3d.h>
#include <ias_drawer_executive/Pressure.h>
#include <ias_drawer_executive/Poses.h>
#include <ias_drawer_executive/AverageTF.h>
#include <ias_drawer_executive/Torso.h>
#include <ias_drawer_executive/Head.h>
#include <ias_drawer_executive/Approach.h>
#include <cop_client_cpp/cop_client.h>
#include <geometry_msgs/PoseStamped.h>
#include <boost/thread.hpp>
#include "boost/date_time/posix_time/posix_time.hpp"
#include <stdio.h>
#include <stdlib.h>
Go to the source code of this file.
Functions | |
void | printTransform (const char title[], btTransform a) |
btTransform | scaleTransform (const btTransform &in, double scale) |
void | spinner (Approach *apr) |
void printTransform | ( | const char | title[], |
btTransform | a | ||
) |
Definition at line 355 of file OperateHandleController.cpp.
btTransform scaleTransform | ( | const btTransform & | in, |
double | scale | ||
) |
Definition at line 347 of file OperateHandleController.cpp.
Definition at line 758 of file OperateHandleController.cpp.