#include <sstream>
#include <stdexcept>
#include <boost/bind.hpp>
#include <boost/date_time.hpp>
#include <Eigen/LU>
#include <LinearMath/btMatrix3x3.h>
#include <LinearMath/btQuaternion.h>
#include <ros/ros.h>
#include "halfsteps_pattern_generator.hh"
#include "binary.hh"
#include "yaml.hh"
#include "geometry_msgs/Pose.h"
#include "visualization_msgs/MarkerArray.h"
#include "halfsteps_pattern_generator/GetPath.h"
#include "halfsteps_pattern_generator/Footprint.h"
#include <walk_msgs/conversion.hh>
#include <walk_msgs/abstract-node.hh>
Go to the source code of this file.
Classes | |
class | GeneratorNode |
Functions | |
template<typename T > | |
T | getParam (const std::string ¶m, const T &defaultValue) |
int | main (int argc, char **argv) |
T getParam | ( | const std::string & | param, |
const T & | defaultValue | ||
) |
Definition at line 36 of file generator.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 116 of file generator.cpp.