#include "jsk_footstep_planner/footstep_marker.h"#include <jsk_topic_tools/log_utils.h>#include <jsk_recognition_utils/pcl_conversion_util.h>#include <jsk_interactive_marker/interactive_marker_helpers.h>#include <boost/format.hpp>#include <pcl/common/eigen.h>#include <angles/angles.h>#include "jsk_footstep_planner/footstep_conversions.h"#include <jsk_topic_tools/rosparam_utils.h>#include <jsk_interactive_marker/SnapFootPrint.h>#include <jsk_footstep_planner/CollisionBoundingBoxInfo.h>#include <dynamic_reconfigure/Reconfigure.h>
Go to the source code of this file.
Namespaces | |
| jsk_footstep_planner | |
| jsk_recognition_utils | |
Macros | |
| #define | printAffine(af) |
Functions | |
| void | jsk_footstep_planner::add3Dof2DControl (visualization_msgs::InteractiveMarker &msg, bool fixed) |
| void | jsk_recognition_utils::convertEigenAffine3 (const Eigen::Affine3f &from, Eigen::Affine3f &to) |
| int | main (int argc, char **argv) |
| #define printAffine | ( | af | ) |
Definition at line 49 of file footstep_marker.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 1314 of file footstep_marker.cpp.