$search
#include <mongo_ros/metadata.h>#include <ros/ros.h>#include <boost/shared_ptr.hpp>

Go to the source code of this file.
| Namespaces | |
| namespace | mongo_ros | 
| Functions | |
| void | mongo_ros::dropDatabase (const std::string &db) | 
| boost::shared_ptr < mongo::DBClientConnection > | mongo_ros::makeDbConnection (const ros::NodeHandle &nh, const string &host="", const unsigned &port=0) | 
| std::string | mongo_ros::messageType (mongo::DBClientConnection &conn, const std::string &db, const std::string &coll) | 
| Return the ROS Message type of a given collection. | |
Db-level operations. Most operations are in message_collection.h
Definition in file mongo_ros.h.