Namespaces | |
namespace | msgs |
Classes | |
class | StepPlan |
Functions | |
template<typename Tin , typename Tout > | |
void | copyPosition (const Tin &p_in, Tout &p_out) |
msgs::ErrorStatus | createErrorStatus (const std::string &context, unsigned int error, const std::string &error_msg, unsigned int warning, const std::string &warning_msg, bool output=true, double throttle_rate=0.0) |
std::string | ErrorStatusCodeToString (unsigned int error) |
msgs::ErrorStatus | ErrorStatusError (unsigned int error, const std::string &context, const std::string &error_msg, bool output=true, double throttle_rate=0.0) |
msgs::ErrorStatus | ErrorStatusWarning (unsigned int warning, const std::string &context, const std::string &warning_msg, bool output=true, double throttle_rate=0.0) |
bool | hasError (const msgs::ErrorStatus &status) |
bool | hasWarning (const msgs::ErrorStatus &status) |
msgs::ErrorStatus | isConsistent (const msgs::StepPlan &result) |
void | isEqualTest (const std_msgs::String &exp, const std_msgs::String &res) |
void | isEqualTest (const std_msgs::Header &exp, const std_msgs::Header &res) |
void | isEqualTest (const geometry_msgs::Point &exp, const geometry_msgs::Point &res) |
void | isEqualTest (const geometry_msgs::Quaternion &exp, const geometry_msgs::Quaternion &res) |
void | isEqualTest (const geometry_msgs::Pose &exp, const geometry_msgs::Pose &res) |
void | isEqualTest (const msgs::Foot &exp, const msgs::Foot &res) |
void | isEqualTest (const msgs::Feet &exp, const msgs::Feet &res) |
void | isEqualTest (const msgs::Step &exp, const msgs::Step &res) |
void | isEqualTest (const msgs::StepPlan &exp, const msgs::StepPlan &res) |
void | isEqualTest (const StepPlan &exp, const StepPlan &res) |
bool | isOk (const msgs::ErrorStatus &status) |
msgs::ErrorStatus | operator+ (const msgs::ErrorStatus &lhs, const msgs::ErrorStatus &rhs) |
msgs::ErrorStatus | operator+= (msgs::ErrorStatus &lhs, const msgs::ErrorStatus &rhs) |
std::string | toString (const msgs::ErrorStatus &error_status) |
std::string | toString (const msgs::FootstepExecutionStatus &execution_status) |
std::string | WarningStatusCodeToString (unsigned int warning) |
void vigir_footstep_planning::copyPosition | ( | const Tin & | p_in, |
Tout & | p_out | ||
) |
Definition at line 113 of file footstep_planning_msgs.h.
msgs::ErrorStatus vigir_footstep_planning::createErrorStatus | ( | const std::string & | context, |
unsigned int | error, | ||
const std::string & | error_msg, | ||
unsigned int | warning, | ||
const std::string & | warning_msg, | ||
bool | output = true , |
||
double | throttle_rate = 0.0 |
||
) |
Definition at line 88 of file footstep_planning_msgs.cpp.
std::string vigir_footstep_planning::ErrorStatusCodeToString | ( | unsigned int | error | ) |
Definition at line 56 of file footstep_planning_msgs.cpp.
msgs::ErrorStatus vigir_footstep_planning::ErrorStatusError | ( | unsigned int | error, |
const std::string & | context, | ||
const std::string & | error_msg, | ||
bool | output = true , |
||
double | throttle_rate = 0.0 |
||
) |
Definition at line 116 of file footstep_planning_msgs.cpp.
msgs::ErrorStatus vigir_footstep_planning::ErrorStatusWarning | ( | unsigned int | warning, |
const std::string & | context, | ||
const std::string & | warning_msg, | ||
bool | output = true , |
||
double | throttle_rate = 0.0 |
||
) |
Definition at line 121 of file footstep_planning_msgs.cpp.
bool vigir_footstep_planning::hasError | ( | const msgs::ErrorStatus & | status | ) |
Definition at line 126 of file footstep_planning_msgs.cpp.
bool vigir_footstep_planning::hasWarning | ( | const msgs::ErrorStatus & | status | ) |
Definition at line 131 of file footstep_planning_msgs.cpp.
msgs::ErrorStatus vigir_footstep_planning::isConsistent | ( | const msgs::StepPlan & | result | ) |
Definition at line 31 of file footstep_planning_msgs.cpp.
void vigir_footstep_planning::isEqualTest | ( | const std_msgs::String & | exp, |
const std_msgs::String & | res | ||
) |
Definition at line 9 of file msgs_test_helper.cpp.
void vigir_footstep_planning::isEqualTest | ( | const std_msgs::Header & | exp, |
const std_msgs::Header & | res | ||
) |
Definition at line 14 of file msgs_test_helper.cpp.
void vigir_footstep_planning::isEqualTest | ( | const geometry_msgs::Point & | exp, |
const geometry_msgs::Point & | res | ||
) |
Definition at line 21 of file msgs_test_helper.cpp.
void vigir_footstep_planning::isEqualTest | ( | const geometry_msgs::Quaternion & | exp, |
const geometry_msgs::Quaternion & | res | ||
) |
Definition at line 28 of file msgs_test_helper.cpp.
void vigir_footstep_planning::isEqualTest | ( | const geometry_msgs::Pose & | exp, |
const geometry_msgs::Pose & | res | ||
) |
Definition at line 36 of file msgs_test_helper.cpp.
void vigir_footstep_planning::isEqualTest | ( | const msgs::Foot & | exp, |
const msgs::Foot & | res | ||
) |
Definition at line 42 of file msgs_test_helper.cpp.
void vigir_footstep_planning::isEqualTest | ( | const msgs::Feet & | exp, |
const msgs::Feet & | res | ||
) |
Definition at line 49 of file msgs_test_helper.cpp.
void vigir_footstep_planning::isEqualTest | ( | const msgs::Step & | exp, |
const msgs::Step & | res | ||
) |
Definition at line 56 of file msgs_test_helper.cpp.
void vigir_footstep_planning::isEqualTest | ( | const msgs::StepPlan & | exp, |
const msgs::StepPlan & | res | ||
) |
Definition at line 72 of file msgs_test_helper.cpp.
void vigir_footstep_planning::isEqualTest | ( | const StepPlan & | exp, |
const StepPlan & | res | ||
) |
Definition at line 86 of file msgs_test_helper.cpp.
bool vigir_footstep_planning::isOk | ( | const msgs::ErrorStatus & | status | ) |
Definition at line 136 of file footstep_planning_msgs.cpp.
msgs::ErrorStatus vigir_footstep_planning::operator+ | ( | const msgs::ErrorStatus & | lhs, |
const msgs::ErrorStatus & | rhs | ||
) |
Definition at line 6 of file footstep_planning_msgs.cpp.
msgs::ErrorStatus vigir_footstep_planning::operator+= | ( | msgs::ErrorStatus & | lhs, |
const msgs::ErrorStatus & | rhs | ||
) |
Definition at line 25 of file footstep_planning_msgs.cpp.
std::string vigir_footstep_planning::toString | ( | const msgs::ErrorStatus & | error_status | ) |
Definition at line 141 of file footstep_planning_msgs.cpp.
std::string vigir_footstep_planning::toString | ( | const msgs::FootstepExecutionStatus & | execution_status | ) |
Definition at line 158 of file footstep_planning_msgs.cpp.
std::string vigir_footstep_planning::WarningStatusCodeToString | ( | unsigned int | warning | ) |
Definition at line 76 of file footstep_planning_msgs.cpp.