#include <mongo_ros/mongo_ros.h>
#include <mongo_ros/exceptions.h>
#include <mongo_ros/message_collection.h>
Go to the source code of this file.
Namespaces | |
namespace | mongo_ros |
Functions | |
void | mongo_ros::dropDatabase (const string &db_name) |
void | mongo_ros::dropDatabase (const string &db, const string &host, const unsigned port, const float timeout) |
string | mongo_ros::getHost (ros::NodeHandle nh, const string &host="") |
template<class P > | |
P | mongo_ros::getParam (const ros::NodeHandle &nh, const string &name, const P &default_val) |
Get a parameter, with default values. | |
int | mongo_ros::getPort (ros::NodeHandle nh, const int port=0) |
boost::shared_ptr < mongo::DBClientConnection > | mongo_ros::makeDbConnection (const ros::NodeHandle &nh, const string &host, const unsigned &port, const float timeout) |
string | mongo_ros::messageType (mongo::DBClientConnection &conn, const string &db, const string &coll) |
Implementation of mongo_ros.h
Definition in file mongo_ros.cpp.