msgs_test_helper.cpp
Go to the documentation of this file.
2 
3 #include <gtest/gtest.h>
4 
5 
6 
8 {
9 void isEqualTest(const std_msgs::String& exp, const std_msgs::String& res)
10 {
11  EXPECT_EQ(exp.data, res.data);
12 }
13 
14 void isEqualTest(const std_msgs::Header& exp, const std_msgs::Header& res)
15 {
16  EXPECT_EQ(exp.seq, res.seq);
17  EXPECT_EQ(exp.stamp, res.stamp);
18  EXPECT_EQ(exp.frame_id, res.frame_id);
19 }
20 
21 void isEqualTest(const geometry_msgs::Point& exp, const geometry_msgs::Point& res)
22 {
23  EXPECT_DOUBLE_EQ(exp.x, res.x);
24  EXPECT_DOUBLE_EQ(exp.y, res.y);
25  EXPECT_DOUBLE_EQ(exp.z, res.z);
26 }
27 
28 void isEqualTest(const geometry_msgs::Quaternion& exp, const geometry_msgs::Quaternion& res)
29 {
30  EXPECT_DOUBLE_EQ(exp.x, res.x);
31  EXPECT_DOUBLE_EQ(exp.y, res.y);
32  EXPECT_DOUBLE_EQ(exp.z, res.z);
33  EXPECT_DOUBLE_EQ(exp.w, res.w);
34 }
35 
36 void isEqualTest(const geometry_msgs::Pose& exp, const geometry_msgs::Pose& res)
37 {
38  isEqualTest(exp.position, res.position);
39  isEqualTest(exp.orientation, res.orientation);
40 }
41 
42 void isEqualTest(const msgs::Foot& exp, const msgs::Foot& res)
43 {
44  isEqualTest(exp.header, res.header);
45  EXPECT_EQ(exp.foot_index, res.foot_index);
46  isEqualTest(exp.pose, res.pose);
47 }
48 
49 void isEqualTest(const msgs::Feet& exp, const msgs::Feet& res)
50 {
51  isEqualTest(exp.header, res.header);
52  isEqualTest(exp.left, res.left);
53  isEqualTest(exp.right, res.right);
54 }
55 
56 void isEqualTest(const msgs::Step& exp, const msgs::Step& res)
57 {
58  isEqualTest(exp.header, res.header);
59  isEqualTest(exp.foot, res.foot);
60  EXPECT_EQ(exp.step_index, res.step_index);
61  EXPECT_FLOAT_EQ(exp.cost, res.cost);
62  EXPECT_FLOAT_EQ(exp.risk, res.risk);
63  EXPECT_EQ(exp.valid, res.valid);
64  EXPECT_EQ(exp.colliding, res.colliding);
65  EXPECT_EQ(exp.locked, res.locked);
66  EXPECT_EQ(exp.modified, res.modified);
67  EXPECT_FLOAT_EQ(exp.sway_duration, res.sway_duration);
68  EXPECT_FLOAT_EQ(exp.step_duration, res.step_duration);
69  EXPECT_FLOAT_EQ(exp.swing_height, res.swing_height);
70 }
71 
72 void isEqualTest(const msgs::StepPlan& exp, const msgs::StepPlan& res)
73 {
74  isEqualTest(exp.header, res.header);
75  isEqualTest(exp.parameter_set_name, res.parameter_set_name);
76  isEqualTest(exp.start, res.start);
77  isEqualTest(exp.goal, res.goal);
78 
79  ASSERT_EQ(exp.steps.size(), res.steps.size());
80  for (size_t i = 0; i < exp.steps.size(); i++)
81  isEqualTest(exp.steps[i], res.steps[i]);
82 
83  EXPECT_EQ(exp.mode, res.mode);
84 }
85 
86 void isEqualTest(const StepPlan& exp, const StepPlan& res)
87 {
88  msgs::StepPlan exp_steps;
89  exp.toMsg(exp_steps);
90 
91  msgs::StepPlan res_steps;
92  res.toMsg(res_steps);
93 
94  isEqualTest(exp_steps, res_steps);
95 }
96 }
msgs::ErrorStatus toMsg(msgs::StepPlan &step_plan) const
Definition: step_plan.cpp:517
void isEqualTest(const std_msgs::String &exp, const std_msgs::String &res)


vigir_footstep_planning_msgs
Author(s): Alexander Stumpf
autogenerated on Mon Jun 10 2019 15:45:25