37 #ifndef JSK_FOOTSTEP_PLANNER_FOOTSTEP_CONVERSIONS_H_
38 #define JSK_FOOTSTEP_PLANNER_FOOTSTEP_CONVERSIONS_H_
40 #include <jsk_footstep_msgs/Footstep.h>
41 #include <jsk_footstep_msgs/FootstepArray.h>
42 #include <visualization_msgs/Marker.h>
43 #include <visualization_msgs/MarkerArray.h>
44 #include <Eigen/Geometry>
50 visualization_msgs::Marker
footstepToMarker(
const jsk_footstep_msgs::Footstep& footstep,
const std_msgs::Header& header);