#include <chrono>#include <future>#include <thread>#include <gtest/gtest.h>#include <rclcpp_components/component_manager.hpp>#include <std_msgs/msg/string.hpp>#include <std_srvs/srv/set_bool.hpp>#include <websocketpp/config/asio_client.hpp>#include <foxglove_bridge/test/test_client.hpp>#include <foxglove_bridge/websocket_client.hpp>
Go to the source code of this file.
Classes | |
| class | ExistingPublisherTest |
| class | ParameterTest |
| class | ServiceTest |
Macros | |
| #define | ASIO_STANDALONE |
Functions | |
| template<class T > | |
| std::shared_ptr< T > | deserializeMsg (const rcl_serialized_message_t *msg) |
| int | main (int argc, char **argv) |
| template<class T > | |
| std::shared_ptr< rclcpp::SerializedMessage > | serializeMsg (const T *msg) |
| TEST (SmokeTest, testConnection) | |
| TEST (SmokeTest, testSubscription) | |
| TEST (SmokeTest, testSubscriptionParallel) | |
| TEST (SmokeTest, testPublishing) | |
| TEST_F (ExistingPublisherTest, testPublishingWithExistingPublisher) | |
| TEST_F (ParameterTest, testGetAllParams) | |
| TEST_F (ParameterTest, testGetNonExistingParameters) | |
| TEST_F (ParameterTest, testGetParameters) | |
| TEST_F (ParameterTest, testSetParameters) | |
| TEST_F (ParameterTest, testSetParametersWithReqId) | |
| TEST_F (ParameterTest, testUnsetParameter) | |
| TEST_F (ParameterTest, testParameterSubscription) | |
| TEST_F (ParameterTest, testGetParametersParallel) | |
| TEST_F (ServiceTest, testCallServiceParallel) | |
Variables | |
| constexpr auto | DEFAULT_TIMEOUT = std::chrono::seconds(10) |
| constexpr uint8_t | HELLO_WORLD_BINARY [] |
| constexpr auto | ONE_SECOND = std::chrono::seconds(1) |
| constexpr char | URI [] = "ws://localhost:8765" |
| #define ASIO_STANDALONE |
Definition at line 1 of file ros2_foxglove_bridge/tests/smoke_test.cpp.
| std::shared_ptr<T> deserializeMsg | ( | const rcl_serialized_message_t * | msg | ) |
Definition at line 148 of file ros2_foxglove_bridge/tests/smoke_test.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 500 of file ros2_foxglove_bridge/tests/smoke_test.cpp.
| std::shared_ptr<rclcpp::SerializedMessage> serializeMsg | ( | const T * | msg | ) |
Definition at line 138 of file ros2_foxglove_bridge/tests/smoke_test.cpp.
| TEST | ( | SmokeTest | , |
| testConnection | |||
| ) |
Definition at line 157 of file ros2_foxglove_bridge/tests/smoke_test.cpp.
| TEST | ( | SmokeTest | , |
| testSubscription | |||
| ) |
Definition at line 162 of file ros2_foxglove_bridge/tests/smoke_test.cpp.
| TEST | ( | SmokeTest | , |
| testSubscriptionParallel | |||
| ) |
Definition at line 184 of file ros2_foxglove_bridge/tests/smoke_test.cpp.
| TEST | ( | SmokeTest | , |
| testPublishing | |||
| ) |
Definition at line 212 of file ros2_foxglove_bridge/tests/smoke_test.cpp.
| TEST_F | ( | ExistingPublisherTest | , |
| testPublishingWithExistingPublisher | |||
| ) |
Definition at line 244 of file ros2_foxglove_bridge/tests/smoke_test.cpp.
| TEST_F | ( | ParameterTest | , |
| testGetAllParams | |||
| ) |
Definition at line 276 of file ros2_foxglove_bridge/tests/smoke_test.cpp.
| TEST_F | ( | ParameterTest | , |
| testGetNonExistingParameters | |||
| ) |
Definition at line 286 of file ros2_foxglove_bridge/tests/smoke_test.cpp.
| TEST_F | ( | ParameterTest | , |
| testGetParameters | |||
| ) |
Definition at line 297 of file ros2_foxglove_bridge/tests/smoke_test.cpp.
| TEST_F | ( | ParameterTest | , |
| testSetParameters | |||
| ) |
Definition at line 326 of file ros2_foxglove_bridge/tests/smoke_test.cpp.
| TEST_F | ( | ParameterTest | , |
| testSetParametersWithReqId | |||
| ) |
Definition at line 364 of file ros2_foxglove_bridge/tests/smoke_test.cpp.
| TEST_F | ( | ParameterTest | , |
| testUnsetParameter | |||
| ) |
Definition at line 380 of file ros2_foxglove_bridge/tests/smoke_test.cpp.
| TEST_F | ( | ParameterTest | , |
| testParameterSubscription | |||
| ) |
Definition at line 395 of file ros2_foxglove_bridge/tests/smoke_test.cpp.
| TEST_F | ( | ParameterTest | , |
| testGetParametersParallel | |||
| ) |
Definition at line 414 of file ros2_foxglove_bridge/tests/smoke_test.cpp.
| TEST_F | ( | ServiceTest | , |
| testCallServiceParallel | |||
| ) |
Definition at line 447 of file ros2_foxglove_bridge/tests/smoke_test.cpp.
| constexpr auto DEFAULT_TIMEOUT = std::chrono::seconds(10) |
Definition at line 23 of file ros2_foxglove_bridge/tests/smoke_test.cpp.
| constexpr uint8_t HELLO_WORLD_BINARY[] |
Definition at line 19 of file ros2_foxglove_bridge/tests/smoke_test.cpp.
| constexpr auto ONE_SECOND = std::chrono::seconds(1) |
Definition at line 22 of file ros2_foxglove_bridge/tests/smoke_test.cpp.
| constexpr char URI[] = "ws://localhost:8765" |
Definition at line 16 of file ros2_foxglove_bridge/tests/smoke_test.cpp.