Defines | Functions
bench_footstep_planner.cpp File Reference
#include <jsk_footstep_msgs/FootstepArray.h>
#include "jsk_footstep_planner/footstep_graph.h"
#include "jsk_footstep_planner/astar_solver.h"
#include "jsk_footstep_planner/footstep_astar_solver.h"
#include <time.h>
#include <boost/random.hpp>
#include <fstream>
#include <boost/program_options.hpp>
#include <boost/algorithm/string.hpp>
#include "jsk_footstep_planner/pointcloud_model_generator.h"
Include dependency graph for bench_footstep_planner.cpp:

Go to the source code of this file.

Defines

#define OPTION_DEFAULT_VALUE(TYPE, VALUE)   boost::program_options::value<TYPE>()->default_value(VALUE)
#define OPTION_TYPE(TYPE)   boost::program_options::value<TYPE>()

Functions

const Eigen::Vector3f footstep_size (0.2, 0.1, 0.000001)
int main (int argc, char **argv)
bool planBench (double x, double y, double yaw, FootstepGraph::Ptr graph, Eigen::Vector3f footstep_size, const std::string heuristic, const double first_rotation_weight, const double second_rotation_weight, Eigen::Vector3f res)
void progressBar (int x, int n, int w)
void setupGraph (FootstepGraph::Ptr graph, Eigen::Vector3f res)

Define Documentation

#define OPTION_DEFAULT_VALUE (   TYPE,
  VALUE 
)    boost::program_options::value<TYPE>()->default_value(VALUE)

Definition at line 50 of file bench_footstep_planner.cpp.

#define OPTION_TYPE (   TYPE)    boost::program_options::value<TYPE>()

Definition at line 51 of file bench_footstep_planner.cpp.


Function Documentation

const Eigen::Vector3f footstep_size ( 0.  2,
0.  1,
0.  000001 
)
int main ( int  argc,
char **  argv 
)

Definition at line 146 of file bench_footstep_planner.cpp.

bool planBench ( double  x,
double  y,
double  yaw,
FootstepGraph::Ptr  graph,
Eigen::Vector3f  footstep_size,
const std::string  heuristic,
const double  first_rotation_weight,
const double  second_rotation_weight,
Eigen::Vector3f  res 
) [inline]

Definition at line 81 of file bench_footstep_planner.cpp.

void progressBar ( int  x,
int  n,
int  w 
) [inline]

Definition at line 124 of file bench_footstep_planner.cpp.

void setupGraph ( FootstepGraph::Ptr  graph,
Eigen::Vector3f  res 
)

Definition at line 53 of file bench_footstep_planner.cpp.



jsk_footstep_planner
Author(s): Ryohei Ueda
autogenerated on Wed Sep 16 2015 04:37:57