#include <ros/ros.h>
#include <geometry_msgs/Pose.h>
#include <vigir_footstep_planning_msgs/footstep_planning_msgs.h>
#include <vigir_footstep_planning_msgs/step_plan.h>
Go to the source code of this file.
Namespaces | |
namespace | vigir_footstep_planning |
Functions | |
void | vigir_footstep_planning::isEqualTest (const std_msgs::String &exp, const std_msgs::String &res) |
void | vigir_footstep_planning::isEqualTest (const std_msgs::Header &exp, const std_msgs::Header &res) |
void | vigir_footstep_planning::isEqualTest (const geometry_msgs::Point &exp, const geometry_msgs::Point &res) |
void | vigir_footstep_planning::isEqualTest (const geometry_msgs::Quaternion &exp, const geometry_msgs::Quaternion &res) |
void | vigir_footstep_planning::isEqualTest (const geometry_msgs::Pose &exp, const geometry_msgs::Pose &res) |
void | vigir_footstep_planning::isEqualTest (const msgs::Foot &exp, const msgs::Foot &res) |
void | vigir_footstep_planning::isEqualTest (const msgs::Feet &exp, const msgs::Feet &res) |
void | vigir_footstep_planning::isEqualTest (const msgs::Step &exp, const msgs::Step &res) |
void | vigir_footstep_planning::isEqualTest (const msgs::StepPlan &exp, const msgs::StepPlan &res) |
void | vigir_footstep_planning::isEqualTest (const StepPlan &exp, const StepPlan &res) |