30 #include <gtest/gtest.h> 35 #include "rostest/permuter.h" 39 TEST(StaticTransformPublisher, a_b_different_times)
48 TEST(StaticTransformPublisher, a_c_different_times)
57 TEST(StaticTransformPublisher, a_d_different_times)
61 geometry_msgs::TransformStamped ts;
62 ts.transform.rotation.w = 1;
63 ts.header.frame_id =
"c";
65 ts.child_frame_id =
"d";
82 TEST(StaticTransformPublisher, multiple_parent_test)
87 geometry_msgs::TransformStamped ts;
88 ts.transform.rotation.w = 1;
89 ts.header.frame_id =
"c";
91 ts.child_frame_id =
"d";
101 ts.header.frame_id =
"new_parent";
103 ts.child_frame_id =
"other_child";
105 ts.child_frame_id =
"other_child2";
114 TEST(StaticTransformPublisher, tf_from_param_server_valid)
124 int main(
int argc,
char **argv){
125 testing::InitGoogleTest(&argc, argv);
127 return RUN_ALL_TESTS();
bool setTransform(const geometry_msgs::TransformStamped &transform, const std::string &authority, bool is_static=false)
int main(int argc, char **argv)
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
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(StaticTransformPublisher, a_b_different_times)