Main Page
Namespaces
Classes
Files
File List
File Members
include
robot_model_services
test_cases
BaseTest.h
Go to the documentation of this file.
1
20
#define BOOST_TEST_STATIC_LINK
21
22
#include <
ros/ros.h
>
23
#include <boost/array.hpp>
24
#include <iostream>
25
#include <vector>
26
#include <string>
27
#include <glpk.h>
28
#include <map>
29
30
#include <geometry_msgs/PoseWithCovarianceStamped.h>
31
#include <visualization_msgs/MarkerArray.h>
32
#include <sensor_msgs/PointCloud2.h>
33
#include <
tf/transform_datatypes.h
>
34
#include <dynamic_reconfigure/Reconfigure.h>
35
36
#include "asr_msgs/AsrAttributedPoint.h"
37
38
#include "
robot_model_services/helper/MathHelper.hpp
"
39
#include "
robot_model_services/helper/MapHelper.hpp
"
40
#include "
robot_model_services/helper/TypeHelper.hpp
"
41
#include "
robot_model_services/robot_model/impl/MILDRobotModel.hpp
"
42
#include "
robot_model_services/robot_model/impl/MILDRobotModelWithExactIK.hpp
"
43
#include "
robot_model_services/robot_model/impl/MILDRobotState.hpp
"
44
#include <
tf/tf.h
>
45
46
#include <Eigen/Dense>
47
#include <Eigen/Geometry>
48
49
#include <
ros/master.h
>
50
51
using namespace
robot_model_services
;
52
53
class
BaseTest
{
54
protected
:
55
boost::shared_ptr<ros::NodeHandle>
mNodeHandle
;
56
ros::Publisher
mInitPosePub
;
57
bool
silent
;
58
public
:
59
BaseTest
();
60
61
BaseTest
(
bool
silent);
62
63
~
BaseTest
();
64
65
void
init(
bool
silent);
66
67
void
initRosServices();
68
69
70
robot_model_services::MILDRobotStatePtr
getRobotState(
const
geometry_msgs::Pose &initialPose);
71
72
void
waitForEnter();
73
74
SimpleQuaternion
euler2Quaternion(
const
Precision
roll,
const
Precision
pitch,
const
Precision
yaw);
75
76
SimpleQuaternion
ZXZ2Quaternion(
const
Precision
roll,
const
Precision
pitch,
const
Precision
yaw);
77
78
template
<
typename
T>
bool
getParameter
(
const
std::string &key, T ¶meter)
79
{
80
if
(!mNodeHandle->getParam(key, parameter))
81
{
82
ROS_ERROR_STREAM
(key <<
" parameter not set!"
);
83
return
false
;
84
}
85
else
86
{
87
return
true
;
88
}
89
}
90
};
91
BaseTest::mNodeHandle
boost::shared_ptr< ros::NodeHandle > mNodeHandle
Definition:
BaseTest.h:55
BaseTest::getParameter
bool getParameter(const std::string &key, T ¶meter)
Definition:
BaseTest.h:78
MILDRobotState.hpp
TypeHelper.hpp
master.h
transform_datatypes.h
boost::shared_ptr< ros::NodeHandle >
robot_model_services
this namespace contains all generally usable classes.
Definition:
DebugHelper.hpp:27
MILDRobotModelWithExactIK.hpp
MathHelper.hpp
BaseTest::silent
bool silent
Definition:
BaseTest.h:57
ros.h
MILDRobotModel.hpp
MapHelper.hpp
BaseTest::mInitPosePub
ros::Publisher mInitPosePub
Definition:
BaseTest.h:56
ROS_ERROR_STREAM
#define ROS_ERROR_STREAM(args)
ros::Publisher
BaseTest
Definition:
BaseTest.h:53
robot_model_services::SimpleQuaternion
Eigen::Quaternion< Precision > SimpleQuaternion
Definition:
typedef.hpp:64
tf.h
robot_model_services::Precision
float Precision
Definition:
typedef.hpp:33
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