30 #ifndef FOOTSTEP_PLANNER_STATE_H__ 31 #define FOOTSTEP_PLANNER_STATE_H__ 33 #include <geometry_msgs/Pose.h> 34 #include <geometry_msgs/Vector3.h> 36 #include <vigir_footstep_planning_msgs/footstep_planning_msgs.h> 53 State(
double x,
double y,
double z,
double roll,
double pitch,
double yaw,
Leg leg);
54 State(
const geometry_msgs::Vector3& position,
double roll,
double pitch,
double yaw,
Leg leg);
55 State(
const geometry_msgs::Vector3& position,
const geometry_msgs::Vector3& normal,
double yaw,
Leg leg);
56 State(
const geometry_msgs::Pose& pose,
Leg leg);
58 State(
const msgs::Foot foot);
78 void setPosition(
const geometry_msgs::Point& position);
82 void setRPY(
double roll,
double pitch,
double yaw);
84 void setNormal(
const geometry_msgs::Vector3 &normal);
85 void setNormal(
double x,
double y,
double z);
120 void getFoot(msgs::Foot& foot)
const;
121 void getStep(msgs::Step& step)
const;
TFSIMD_FORCE_INLINE void setX(tfScalar x)
TFSIMD_FORCE_INLINE void setY(tfScalar y)
TFSIMD_FORCE_INLINE void setZ(tfScalar z)
TFSIMD_FORCE_INLINE const tfScalar & getY() const
TFSIMD_FORCE_INLINE const tfScalar & y() const
TFSIMD_FORCE_INLINE const tfScalar & getZ() const
TFSIMD_FORCE_INLINE const tfScalar & x() const
TFSIMD_FORCE_INLINE const tfScalar & z() const
TFSIMD_FORCE_INLINE const tfScalar & getX() const