Namespaces | Defines | Functions
footstep_marker.cpp File Reference
#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>
Include dependency graph for footstep_marker.cpp:

Go to the source code of this file.

Namespaces

namespace  jsk_footstep_planner
namespace  jsk_recognition_utils

Defines

#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 Documentation

#define printAffine (   af)
Value:
{ \
  geometry_msgs::Pose __geom_pose;\
  tf::poseEigenToMsg(af, __geom_pose);\
  std::cerr << __geom_pose.position.x << ", ";\
  std::cerr << __geom_pose.position.y << ", ";\
  std::cerr << __geom_pose.position.z << " / ";\
  std::cerr << __geom_pose.orientation.w << ", ";\
  std::cerr << __geom_pose.orientation.x << ", ";\
  std::cerr << __geom_pose.orientation.y << ", ";\
  std::cerr << __geom_pose.orientation.z << std::endl; }

Definition at line 49 of file footstep_marker.cpp.


Function Documentation

int main ( int  argc,
char **  argv 
)

Definition at line 1314 of file footstep_marker.cpp.



jsk_footstep_planner
Author(s): Ryohei Ueda
autogenerated on Fri Apr 19 2019 03:45:28