TypeHelper.hpp
Go to the documentation of this file.
1 
20 #ifndef MYTYPEHELPER_HPP_
21 #define MYTYPEHELPER_HPP_
22 
23 #include <geometry_msgs/Pose.h>
24 #include <geometry_msgs/Point.h>
25 #include <geometry_msgs/Quaternion.h>
26 #include <geometry_msgs/Vector3.h>
27 #include <std_msgs/ColorRGBA.h>
28 #include <vector>
30 
31 namespace robot_model_services {
32  class TypeHelper {
33  public:
34  static geometry_msgs::Point getPointMSG(const SimpleVector3 &vector);
35  static geometry_msgs::Quaternion getQuaternionMSG(const SimpleQuaternion &quaternion);
36  static SimpleVector3 getSimpleVector3(const geometry_msgs::Pose &pose);
37  static SimpleVector3 getSimpleVector3(const geometry_msgs::Point &point);
38  static SimpleVector3 getSimpleVector3(const std::vector<double> &vector);
39  static SimpleVector4 getSimpleVector4(const std::vector<double> &vector);
40  static SimpleVector4 getSimpleVector4(const std_msgs::ColorRGBA &color);
41  static SimpleQuaternion getSimpleQuaternion(const geometry_msgs::Pose &pose);
42  static SimpleQuaternion getSimpleQuaternion(const geometry_msgs::Quaternion &quaternion);
43  static SimpleQuaternion getSimpleQuaternion(const std::vector<double> &vector);
44  static geometry_msgs::Vector3 getVector3(const SimpleVector3 &vector);
45  static std_msgs::ColorRGBA getColor(const SimpleVector4 &vector);
46  };
47 }
48 
49 
50 #endif /* MYTYPEHELPER_HPP_ */
static SimpleQuaternion getSimpleQuaternion(const geometry_msgs::Pose &pose)
Definition: TypeHelper.cpp:65
static geometry_msgs::Quaternion getQuaternionMSG(const SimpleQuaternion &quaternion)
Definition: TypeHelper.cpp:33
static SimpleVector4 getSimpleVector4(const std::vector< double > &vector)
Definition: TypeHelper.cpp:57
Eigen::Matrix< Precision, 3, 1 > SimpleVector3
Definition: typedef.hpp:50
static SimpleVector3 getSimpleVector3(const geometry_msgs::Pose &pose)
Definition: TypeHelper.cpp:44
this namespace contains all generally usable classes.
Definition: DebugHelper.hpp:27
static geometry_msgs::Point getPointMSG(const SimpleVector3 &vector)
Definition: TypeHelper.cpp:23
static std_msgs::ColorRGBA getColor(const SimpleVector4 &vector)
Definition: TypeHelper.cpp:88
static geometry_msgs::Vector3 getVector3(const SimpleVector3 &vector)
Definition: TypeHelper.cpp:78
Eigen::Quaternion< Precision > SimpleQuaternion
Definition: typedef.hpp:64
Eigen::Matrix< Precision, 4, 1 > SimpleVector4
Definition: typedef.hpp:52


asr_robot_model_services
Author(s): Aumann Florian, Borella Jocelyn, Heller Florian, Meißner Pascal, Schleicher Ralf, Stöckle Patrick, Stroh Daniel, Trautmann Jeremias, Walter Milena, Wittenbeck Valerij
autogenerated on Mon Jun 10 2019 12:49:59