#include <ros/ros.h>#include "std_msgs/String.h"#include "std_msgs/Bool.h"#include <iostream>#include <vector>#include <string>#include <list>#include "vda5050_msgs/Action.h"#include "vda5050_msgs/OrderActions.h"#include "vda5050_msgs/ActionState.h"#include "vda5050_msgs/InstantActions.h"#include <random>#include <sstream>
Go to the source code of this file.
Namespaces | |
| uuid | |
Functions | |
| static std::uniform_int_distribution | uuid::dis (0, 15) |
| static std::uniform_int_distribution | uuid::dis2 (8, 11) |
| static std::mt19937 | uuid::gen (rd()) |
| std::string | uuid::generate_uuid_v4 () |
| int | main (int argc, char **argv) |
| void | send_instant_action (ros::Publisher *pub) |
| void | send_order_action (ros::Publisher *pub, string ID) |
Variables | |
| static std::random_device | uuid::rd |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 132 of file action_msg_mockup.cpp.
| void send_instant_action | ( | ros::Publisher * | pub | ) |
Definition at line 93 of file action_msg_mockup.cpp.
| void send_order_action | ( | ros::Publisher * | pub, |
| string | ID | ||
| ) |
Definition at line 60 of file action_msg_mockup.cpp.