#include <ros/ros.h>#include <interactive_world_msgs/LoadModels.h>#include <geometry_msgs/Pose.h>#include <jsoncpp/json/json.h>

Go to the source code of this file.
Classes | |
| class | interactive_world_model_fetcher |
Defines | |
| #define | DEFAULT_RMS_HOST "localhost" |
Functions | |
| static size_t | curl_write_cb (void *contents, size_t size, size_t nmemb, void *userp) |
| int | main (int argc, char **argv) |
| #define DEFAULT_RMS_HOST "localhost" |
Definition at line 9 of file interactive_world_model_fetcher.hpp.
| static size_t curl_write_cb | ( | void * | contents, |
| size_t | size, | ||
| size_t | nmemb, | ||
| void * | userp | ||
| ) | [static] |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 169 of file interactive_world_model_fetcher.cpp.