#include <mongo_ros/message_collection.h>
#include <semanticmodel/blob.hh>
#include <semanticmodel/BlobMessage.h>
#include <semanticmodel/SwitchDB.h>
#include <ros/ros.h>
#include <boost/thread.hpp>
#include <boost/circular_buffer.hpp>
#include <image_transport/image_transport.h>
#include <image_transport/camera_subscriber.h>
#include <image_transport/camera_publisher.h>
#include <image_geometry/pinhole_camera_model.h>
#include <tf/transform_listener.h>
#include <geometry_msgs/Pose2D.h>
Go to the source code of this file.
Classes | |
class | semanticmodel::BlobStore |
Namespaces | |
namespace | semanticmodel |
Interface for storing blobs in db
Definition in file blob_store.h.