

Go to the source code of this file.
| Namespaces | |
| namespace | geometry_msgs | 
| Functions | |
| bool | contains (const string &s1, const string &s2) | 
| geometry_msgs::Quaternion | createQuaternionMsgFromYaw (double yaw) | 
| geometry_msgs::Pose | makePose (const double x, const double y, const double theta) | 
| template<class T > | |
| ostream & | operator<< (ostream &str, const mongo_ros::MessageWithMetadata< T > &s) | 
| bool | geometry_msgs::operator== (const Pose &p1, const Pose &p2) | 
| Variables | |
| const double | TOL = 1e-3 | 
| bool contains | ( | const string & | s1, | 
| const string & | s2 | ||
| ) | 
Definition at line 87 of file test_mongo_helpers.h.
| geometry_msgs::Quaternion createQuaternionMsgFromYaw | ( | double | yaw | ) | 
Definition at line 64 of file test_mongo_helpers.h.
| geometry_msgs::Pose makePose | ( | const double | x, | 
| const double | y, | ||
| const double | theta | ||
| ) |  [inline] | 
Definition at line 76 of file test_mongo_helpers.h.
| ostream& operator<< | ( | ostream & | str, | 
| const mongo_ros::MessageWithMetadata< T > & | s | ||
| ) | 
Definition at line 55 of file test_mongo_helpers.h.
| const double TOL = 1e-3 | 
Definition at line 35 of file test_mongo_helpers.h.