#include <boost/filesystem.hpp>
#include <fstream>
#include <libgen.h>
#include <stdexcept>
#include <stdio.h>
#include <yaml-cpp/yaml.h>
#include <bwi_planning_common/structures.h>
#include <tf/transform_datatypes.h>
#include <SDL/SDL_image.h>
Go to the source code of this file.
Namespaces | |
namespace | bwi_planning_common |
Functions | |
void | bwi_planning_common::readDoorFile (const std::string &filename, std::vector< Door > &doors) |
void | bwi_planning_common::readLocationFile (const std::string &filename, std::vector< std::string > &locations, std::vector< int32_t > &location_map) |
bool | bwi_planning_common::readObjectApproachFile (const std::string &filename, std::map< std::string, geometry_msgs::Pose > &object_approach_map) |
size_t | bwi_planning_common::resolveDoor (const std::string &door, const std::vector< Door > &doors) |