#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"
Go to the source code of this file.
|  | 
| 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) | 
|  | 
◆ OPTION_DEFAULT_VALUE
◆ OPTION_TYPE
◆ footstep_size()
◆ main()
      
        
          | int main | ( | int | argc, | 
        
          |  |  | char ** | argv | 
        
          |  | ) |  |  | 
      
 
 
◆ planBench()
◆ progressBar()
  
  | 
        
          | void progressBar | ( | int | x, |  
          |  |  | int | n, |  
          |  |  | int | w |  
          |  | ) |  |  |  | inline | 
 
 
◆ setupGraph()