#include <vigir_footstep_planning_lib/helper.h>
Go to the source code of this file.
Namespaces | |
namespace | vigir_footstep_planning |
Functions | |
msgs::ErrorStatus | vigir_footstep_planning::determineGoalFeetPose (msgs::Feet &goal_feet, ros::ServiceClient &generate_feet_pose_client, const geometry_msgs::PoseStamped &goal_pose) |
msgs::ErrorStatus | vigir_footstep_planning::determineStartFeetPose (msgs::Feet &start_feet, ros::ServiceClient &generate_feet_pose_client, const std_msgs::Header &header) |
bool | vigir_footstep_planning::getFootSize (ros::NodeHandle &nh, geometry_msgs::Vector3 &foot_size) |
bool | vigir_footstep_planning::getGridMapCoords (const nav_msgs::OccupancyGrid &map, double x, double y, int &map_x, int &map_y) |
bool | vigir_footstep_planning::getGridMapIndex (const nav_msgs::OccupancyGrid &map, double x, double y, int &idx) |
bool | vigir_footstep_planning::getRPY (ros::NodeHandle &nh, const std::string name, geometry_msgs::Vector3 &val) |
bool | vigir_footstep_planning::getUpperBodyOriginShift (ros::NodeHandle &nh, geometry_msgs::Vector3 &upper_body_origin_shift) |
bool | vigir_footstep_planning::getUpperBodySize (ros::NodeHandle &nh, geometry_msgs::Vector3 &upper_body_size) |
bool | vigir_footstep_planning::getXYZ (ros::NodeHandle &nh, const std::string name, geometry_msgs::Vector3 &val) |
msgs::ErrorStatus | vigir_footstep_planning::transform (msgs::Foot &foot, ros::ServiceClient &transform_foot_pose_client, const std::string &target_frame) |
msgs::ErrorStatus | vigir_footstep_planning::transform (msgs::Feet &feet, ros::ServiceClient &transform_feet_poses_client, const std::string &target_frame) |
msgs::ErrorStatus | vigir_footstep_planning::transform (msgs::StepPlan &step_plan, ros::ServiceClient &transform_step_plan_client, const std::string &target_frame) |