29 #ifndef VIGIR_FOOTSTEP_PLANNING_MSGS_TEST_HELPER_H__ 30 #define VIGIR_FOOTSTEP_PLANNING_MSGS_TEST_HELPER_H__ 34 #include <geometry_msgs/Pose.h> 43 void isEqualTest(
const std_msgs::String& exp,
const std_msgs::String& res);
44 void isEqualTest(
const std_msgs::Header& exp,
const std_msgs::Header& res);
46 void isEqualTest(
const geometry_msgs::Point& exp,
const geometry_msgs::Point& res);
47 void isEqualTest(
const geometry_msgs::Quaternion& exp,
const geometry_msgs::Quaternion& res);
48 void isEqualTest(
const geometry_msgs::Pose& exp,
const geometry_msgs::Pose& res);
50 void isEqualTest(
const msgs::Foot& exp,
const msgs::Foot& res);
51 void isEqualTest(
const msgs::Feet& exp,
const msgs::Feet& res);
52 void isEqualTest(
const msgs::Step& exp,
const msgs::Step& res);
53 void isEqualTest(
const msgs::StepPlan& exp,
const msgs::StepPlan& res);
55 void isEqualTest(
const StepPlan& exp,
const StepPlan& res);