Classes | Namespaces | Defines
class_loader.h File Reference
#include <ros/ros.h>
#include <geometry_msgs/PolygonStamped.h>
#include <nav_msgs/OccupancyGrid.h>
#include <costmap_cspace_msgs/CSpace3D.h>
#include <costmap_cspace_msgs/CSpace3DUpdate.h>
#include <costmap_cspace/cspace3_cache.h>
#include <costmap_cspace/polygon.h>
#include <string>
#include <map>
Include dependency graph for class_loader.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  costmap_cspace::Costmap3dLayerClassLoader
class  costmap_cspace::Costmap3dLayerSpawner< T >
class  costmap_cspace::Costmap3dLayerSpawnerBase

Namespaces

namespace  costmap_cspace

Defines

#define COSTMAP_3D_LAYER_CLASS_LOADER_ENABLE()
#define COSTMAP_3D_LAYER_CLASS_LOADER_REGISTER(name, klass, id)

Define Documentation

#define COSTMAP_3D_LAYER_CLASS_LOADER_REGISTER (   name,
  klass,
  id 
)
Value:
namespace                                                       \
  {                                                               \
  struct ClassLoaderRegister##id                                  \
  {                                                               \
    ClassLoaderRegister##id()                                     \
    {                                                             \
      costmap_cspace::Costmap3dLayerClassLoader::registerClass(   \
          name,                                                   \
          costmap_cspace::Costmap3dLayerSpawnerBase::Ptr(         \
              new costmap_cspace::Costmap3dLayerSpawner<klass>)); \
    } /* NOLINT(whitespace/braces)*/                              \
  };  /* NOLINT(whitespace/braces)*/                              \
  static ClassLoaderRegister##id g_register_class_##id;           \
  } /* NOLINT(readability/namespace) */

Definition at line 87 of file class_loader.h.



costmap_cspace
Author(s): Atsushi Watanabe
autogenerated on Sat Jun 22 2019 20:07:13