toolsForObject.hpp
Go to the documentation of this file.
00001 /*
00002  * Copyright 2016 SoftBank Robotics Europe
00003  *
00004  * Licensed under the Apache License, Version 2.0 (the "License");
00005  * you may not use this file except in compliance with the License.
00006  * You may obtain a copy of the License at
00007  *
00008  *     http://www.apache.org/licenses/LICENSE-2.0
00009  *
00010  * Unless required by applicable law or agreed to in writing, software
00011  * distributed under the License is distributed on an "AS IS" BASIS,
00012  * WITHOUT WARRANTIES OR CONDITIONS OF ANY KIND, either express or implied.
00013  * See the License for the specific language governing permissions and
00014  * limitations under the License.
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


romeo_moveit_actions
Author(s):
autogenerated on Thu Jun 6 2019 21:57:24