Go to the documentation of this file.00001
00002
00003
00004
00005
00006
00007
00008
00009
00010
00011
00012
00013
00014
00015
00016
00017 #ifndef TOOLSFOROBJECT_H
00018 #define TOOLSFOROBJECT_H
00019
00020 #include <geometry_msgs/Pose.h>
00021
00022 #include "romeo_moveit_actions/metablock.hpp"
00023
00024 namespace moveit_simple_actions
00025 {
00027 void setPose(geometry_msgs::Pose *pose,
00028 const double &x,
00029 const double &y,
00030 const double &z,
00031 const double &ox,
00032 const double &oy,
00033 const double &oz,
00034 const double &ow);
00035
00037 void setPose(geometry_msgs::Pose *pose,
00038 const double &x,
00039 const double &y,
00040 const double &z);
00041
00043 int findObj(std::vector<MetaBlock> *blocks,
00044 const std::string name);
00045
00047 std::vector<std::string> getObjectsList(const std::vector<MetaBlock> &blocks);
00048
00050 std::vector<std::string> getObjectsOldList(std::vector<MetaBlock> *objects);
00051
00053 void swapPoses(geometry_msgs::Pose *pose1,
00054 geometry_msgs::Pose *pose2);
00055 }
00056
00057 #endif // TOOLSFOROBJECT_H