Go to the documentation of this file.
30 #include <gtest/gtest.h>
35 #include <rosgraph_msgs/Clock.h>
42 for (uint8_t i = 0; i < 10; ++i)
44 std::this_thread::sleep_for(std::chrono::milliseconds(100));
49 TEST(tf2_ros_transform_listener, time_backwards)
60 rosgraph_msgs::Clock c;
68 geometry_msgs::TransformStamped msg;
70 msg.header.frame_id =
"foo";
71 msg.child_frame_id =
"bar";
72 msg.transform.rotation.x = 1.0;
92 msg.header.frame_id =
"foo2";
93 msg.child_frame_id =
"bar2";
107 int main(
int argc,
char **argv){
108 testing::InitGoogleTest(&argc, argv);
109 ros::init(argc, argv,
"transform_listener_backwards_reset");
110 return RUN_ALL_TESTS();
int main(int argc, char **argv)
ROSCPP_DECL void init(const M_string &remappings, const std::string &name, uint32_t options=0)
ROSCPP_DECL void spinOnce()
void publish(const boost::shared_ptr< M > &message) const
Publisher advertise(AdvertiseOptions &ops)
Standard implementation of the tf2_ros::BufferInterface abstract data type.
TEST(tf2_ros_transform_listener, time_backwards)
virtual bool canTransform(const std::string &target_frame, const std::string &source_frame, const ros::Time &target_time, const ros::Duration timeout, std::string *errstr=NULL) const
Test if a transform is possible.
tf2_ros
Author(s): Eitan Marder-Eppstein, Wim Meeussen
autogenerated on Sun Feb 4 2024 03:18:16