@@ -46,7 +46,7 @@ def setUp(self):
4646 self .points = np .array ([[1 , 2 , 0 ], [10 , 20 , 30 ]], dtype = np .float32 )
4747
4848 self .point_cloud_in = create_cloud_xyz32 (
49- Header (frame_id = " test" ),
49+ Header (frame_id = ' test' ),
5050 self .points )
5151
5252 def test_simple_transform (self ):
@@ -128,15 +128,15 @@ def test_direct_transform(self):
128128
129129 def test_tf2_ros_transform (self ):
130130 # Our target frame
131- target_frame_name = " base_footprint"
131+ target_frame_name = ' base_footprint'
132132
133133 # We need to create a local test tf buffer
134134 tf_buffer = tf2_ros .Buffer ()
135135
136136 # We need to fill this tf_buffer with a possible transform
137137 # So we create a transform with a 100m z translation
138138 transform = TransformStamped ()
139- transform .header .frame_id = " test"
139+ transform .header .frame_id = ' test'
140140 transform .child_frame_id = target_frame_name
141141 transform .transform .translation .z = 100.0
142142 transform .transform .rotation .w = 1.0
@@ -173,7 +173,7 @@ def test_non_coordinate_fields(self):
173173
174174 # Create cloud with four fields
175175 point_cloud = create_cloud (
176- Header (frame_id = " test" ),
176+ Header (frame_id = ' test' ),
177177 fields ,
178178 points )
179179
0 commit comments