7 #include <gtest/gtest.h>     9 #include <rosgraph_msgs/Log.h>    10 #include <geometry_msgs/WrenchStamped.h>    11 #include <geometry_msgs/Wrench.h>    53     ASSERT_NE((msg->level == rosgraph_msgs::Log::ERROR || msg->level == rosgraph_msgs::Log::FATAL) &&
    54                   msg->name == nodeName_,
    61   SCOPED_TRACE(
"NoErrorsInBoot");
    64   EXPECT_EQ(sub_.getNumPublishers(), 1U);
    70     if (HasFatalFailure())
    72       FAIL() << 
"There were errors in the boot process.\nReceived message from rokubimini node with type ERROR or " void rosoutCallback(const rosgraph_msgs::Log::ConstPtr &msg)
TEST_F(BotaDriverTestBoot, NoErrorsInBoot)
Subscriber subscribe(const std::string &topic, uint32_t queue_size, void(T::*fp)(M), T *obj, const TransportHints &transport_hints=TransportHints())
~BotaDriverTestBoot() override
bool getParam(const std::string &key, std::string &s) const
ROSCPP_DECL void spinOnce()