#include <ros/ros.h>#include <ros/console.h>#include <gtest/gtest.h>#include <tf2_ros/buffer.h>#include <interactive_markers/interactive_marker_server.h>#include <interactive_markers/interactive_marker_client.h>#include <chrono>#include <thread>
Go to the source code of this file.
Macros | |
| #define | DBG_MSG(...) printf( __VA_ARGS__ ); printf("\n"); |
| #define | DBG_MSG_STREAM(...) std::cout << __VA_ARGS__ << std::endl; |
Typedefs | |
| typedef visualization_msgs::InteractiveMarkerInitConstPtr | InitConstPtr |
| typedef visualization_msgs::InteractiveMarkerUpdateConstPtr | UpdateConstPtr |
Functions | |
| void | initCb (const InitConstPtr &msg) |
| int | main (int argc, char **argv) |
| void | resetCb (const std::string &server_id) |
| void | resetReceivedMsgs () |
| void | statusCb (InteractiveMarkerClient::StatusT status, const std::string &server_id, const std::string &msg) |
| TEST (InteractiveMarkerServerAndClient, connect_tf_error) | |
| void | updateCb (const UpdateConstPtr &msg) |
| void | waitMsg () |
Variables | |
| int | init_calls |
| InitConstPtr | init_msg |
| int | reset_calls |
| std::string | reset_server_id |
| int | status_calls |
| int | update_calls |
| UpdateConstPtr | update_msg |
| #define DBG_MSG | ( | ... | ) | printf( __VA_ARGS__ ); printf("\n"); |
Definition at line 44 of file server_client_test.cpp.
| #define DBG_MSG_STREAM | ( | ... | ) | std::cout << __VA_ARGS__ << std::endl; |
Definition at line 45 of file server_client_test.cpp.
| typedef visualization_msgs::InteractiveMarkerInitConstPtr InitConstPtr |
Definition at line 57 of file server_client_test.cpp.
| typedef visualization_msgs::InteractiveMarkerUpdateConstPtr UpdateConstPtr |
Definition at line 58 of file server_client_test.cpp.
| void initCb | ( | const InitConstPtr & | msg | ) |
Definition at line 81 of file server_client_test.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 248 of file server_client_test.cpp.
| void resetCb | ( | const std::string & | server_id | ) |
Definition at line 97 of file server_client_test.cpp.
| void resetReceivedMsgs | ( | ) |
Definition at line 63 of file server_client_test.cpp.
| void statusCb | ( | InteractiveMarkerClient::StatusT | status, |
| const std::string & | server_id, | ||
| const std::string & | msg | ||
| ) |
Definition at line 88 of file server_client_test.cpp.
| TEST | ( | InteractiveMarkerServerAndClient | , |
| connect_tf_error | |||
| ) |
Definition at line 113 of file server_client_test.cpp.
| void updateCb | ( | const UpdateConstPtr & | msg | ) |
Definition at line 74 of file server_client_test.cpp.
| void waitMsg | ( | ) |
Definition at line 104 of file server_client_test.cpp.
| int init_calls |
Definition at line 50 of file server_client_test.cpp.
| InitConstPtr init_msg |
Definition at line 60 of file server_client_test.cpp.
| int reset_calls |
Definition at line 51 of file server_client_test.cpp.
| std::string reset_server_id |
Definition at line 55 of file server_client_test.cpp.
| int status_calls |
Definition at line 52 of file server_client_test.cpp.
| int update_calls |
Definition at line 49 of file server_client_test.cpp.
| UpdateConstPtr update_msg |
Definition at line 61 of file server_client_test.cpp.