13 , ivGroundContactSupport(0.0)
27 State::State(
double x,
double y,
double z,
double roll,
double pitch,
double yaw,
Leg leg)
48 State::State(
const geometry_msgs::Vector3& position,
double roll,
double pitch,
double yaw,
Leg leg)
49 :
State(position.
x, position.
y, position.
z, roll, pitch, yaw, leg)
53 State::State(
const geometry_msgs::Vector3& position,
const geometry_msgs::Vector3& normal,
double yaw,
Leg leg)
136 return not (*
this == s2);
148 double roll, pitch, yaw;
188 geometry_msgs::Vector3 n;
209 foot.pose.position.x =
getX();
210 foot.pose.position.y =
getY();
211 foot.pose.position.z =
getZ();
static void poseMsgToTF(const geometry_msgs::Pose &msg, Pose &bt)
TFSIMD_FORCE_INLINE const tfScalar & y() const
static void quaternionMsgToTF(const geometry_msgs::Quaternion &msg, Quaternion &bt)
void getRPY(tfScalar &roll, tfScalar &pitch, tfScalar &yaw, unsigned int solution_number=1) const
void setRPY(tfScalar roll, tfScalar pitch, tfScalar yaw)
TFSIMD_FORCE_INLINE Vector3()
TFSIMD_FORCE_INLINE const tfScalar & x() const
TFSIMD_FORCE_INLINE const tfScalar & z() const
def shortest_angular_distance(from_angle, to_angle)