#include <cxxabi.h>#include <fstream>#include <iostream>#include <random>#include <regex>#include <typeinfo>#include <geometric_shapes/shapes.h>#include <octomap/OcTree.h>#include "exotica_core/tools.h"#include <ros/package.h>
Go to the source code of this file.
Namespaces | |
| exotica | |
Functions | |
| std::string | exotica::GetTypeName (const std::type_info &type) |
| std::string | exotica::LoadFile (const std::string &path) |
| void | exotica::LoadOBJ (const std::string &data, Eigen::VectorXi &tri, Eigen::VectorXd &vert) |
| LoadOBJ Loads mesh data from an OBJ file. More... | |
| std::shared_ptr< octomap::OcTree > | exotica::LoadOctree (const std::string &file_path) |
| std::shared_ptr< shapes::Shape > | exotica::LoadOctreeAsShape (const std::string &file_path) |
| std::string | exotica::ParsePath (const std::string &path) |
| bool | exotica::PathExists (const std::string &path) |
| std_msgs::ColorRGBA | exotica::RandomColor () |
| RandomColor Generates random opaque color. More... | |
| void | exotica::SaveMatrix (std::string file_name, const Eigen::Ref< const Eigen::MatrixXd > mat) |